ardupilot/libraries
Thomas Watson 2dbf5aefb3 AP_HAL_ESP32: introduce get_HAL_mutable() to complement get_HAL()
Returns a mutable reference to the same HAL for certain purposes where
the HAL needs to be mutated to avoid UB problems with casting away const
and to make the fact that mutation is happening obvious.
2023-11-28 08:24:25 +11:00
..
AC_AttitudeControl AC_AttitudeControl: update for new AC_PID settings 2023-11-21 13:26:23 +11:00
AC_AutoTune AC_AutoTune: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Autorotation AC_Autorotation: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Avoidance AC_Avoidance: Fix some typos 2023-10-12 18:30:42 +11:00
AC_CustomControl AC_CustomControl: update for new AC_PID settings 2023-11-21 13:26:23 +11:00
AC_Fence AC_Fence: Fix some typos 2023-10-12 18:30:42 +11:00
AC_InputManager
AC_PID AC_PID: use AP_Filter for notch configuration 2023-11-21 13:26:23 +11:00
AC_PrecLand AC_PrecLand: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Sprayer AC_Sprayer: Fix some typos 2023-10-12 18:30:42 +11:00
AC_WPNav AC_WPNav: Fix some typos 2023-10-12 18:30:42 +11:00
APM_Control APM_Control: added D_FF support for fixed wing 2023-11-21 13:26:23 +11:00
AP_ADC
AP_ADSB AP_ADSB: create and use AP_MAVLINK_MSG_UAVIONIX_ADSB_OUT_STATUS_ENABLED 2023-11-21 13:21:13 +11:00
AP_AHRS AP_AHRS: compile EKF2 out by default on all boards 2023-11-27 09:05:08 +11:00
AP_AIS AP_AIS: Fix some typos 2023-10-12 18:30:42 +11:00
AP_AccelCal AP_AccelCal: Fix some typos 2023-10-12 18:30:42 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_Airspeed AP_Airspeed: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Arming AP_Arming: Reduce response time when checks go from true to false 2023-11-25 14:59:04 -08:00
AP_Avoidance AP_Avoidance: Change division to multiplication 2023-10-05 08:19:14 +11:00
AP_BLHeli AP_BLHeli: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Baro AP_Baro: Returns directly calculated values 2023-11-18 12:18:36 +11:00
AP_BattMonitor AP_BattMonitor: fixed battery percentage with aux info 2023-11-27 13:02:46 +11:00
AP_Beacon AP_Beacon: fix example when Beacon not available 2023-10-17 18:21:04 +11:00
AP_BoardConfig AP_BoardConfig: add arm/disarm controlled GPIO for module power control 2023-11-18 14:27:05 +11:00
AP_Button AP_Button: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_CANManager AP_CANManager: Fix some typos 2023-10-12 18:30:42 +11:00
AP_CSVReader
AP_Camera AP_Camera: Add Camera_Mount handler for CAMERA_CAPTURE_STATUS request 2023-11-09 13:00:57 +09:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Compass AP_Compass: fix C++ One Definition Rule violations 2023-11-21 13:21:03 +11:00
AP_CustomRotations
AP_DAL AP_DAL: Fix some typos 2023-10-12 18:30:42 +11:00
AP_DDS AP_DDS: Add instructions for running HW test 2023-11-22 21:44:35 -08:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: support CAN serial ports 2023-11-22 17:19:12 +11:00
AP_EFI AP_EFI : Hirth Driver Addition 2023-11-17 13:09:02 +11:00
AP_ESC_Telem AP_ESC_Telem: added stale() method for ESC telem 2023-11-03 08:08:31 +11:00
AP_ExternalAHRS AP_ExternalAHRS: Specify brand on all log messages 2023-11-14 11:02:26 +11:00
AP_ExternalControl AP_ExternalControl: Add WARN_IF_UNUSED 2023-11-01 18:30:54 +11:00
AP_FETtecOneWire AP_FETtecOneWire: fixed build on periph 2023-08-24 13:06:40 +10:00
AP_Filesystem AP_Filesystem: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Follow AP_Follow: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Frsky_Telem AP_Frsky_Telem: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GPS AP_GPS: Fix GSOF autobaud detection msg 2023-11-14 10:26:01 +11:00
AP_Generator AP_Generator: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Gripper AP_Gripper: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GyroFFT AP_GyroFFT: Fix some typos 2023-10-12 18:30:42 +11:00
AP_HAL AP_HAL: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: introduce get_HAL_mutable() to complement get_HAL() 2023-11-28 08:24:25 +11:00
AP_HAL_Empty AP_HAL_Empty: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_Linux AP_HAL_Linux: add newline and remove stray semicolon 2023-10-31 20:34:24 -03:00
AP_HAL_SITL HAL_SITL: use SocketAPM for CAN multicast and SITL_Periph state 2023-11-25 12:19:43 -08:00
AP_Hott_Telem AP_Hott_Telem: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_ICEngine AP_ICEngine: support relay for ignition and I2C for starter 2023-11-17 13:09:02 +11:00
AP_IOMCU AP_IOMCU: fix eventing mask and some minor cleanups 2023-08-15 06:53:48 +10:00
AP_IRLock
AP_InertialNav AP_InertialNav: clarify get_vert_pos_rate AHRS method name to include 'D' 2023-06-06 20:09:28 +10:00
AP_InertialSensor AP_InertialSensor: apply stuck gyro fix to all IxM42xxx sensors 2023-10-29 08:24:04 +11:00
AP_InternalError AP_InternalError: improve gating of use of AP_InternalError library 2023-08-17 09:16:46 +10:00
AP_JSButton AP_JSButton: reserve 4 button functions for script access 2023-09-27 08:14:36 +10:00
AP_KDECAN AP_KDECAN: move and rename CAN Driver_Type enumeration 2023-04-20 08:53:46 +10:00
AP_L1_Control AP_L1_Control: check vehicle yaw (heading) and ground track agree 2023-09-05 10:07:14 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Landing AP_Landing: trim LogStructure base off included code 2023-08-01 10:07:28 +10:00
AP_LandingGear AP_LandingGear: avoid use of MINIMIZE_FEATURES in AP_LandingGear_config.h 2023-08-01 10:44:59 +10:00
AP_LeakDetector
AP_Logger AP_Logger: Prepare the maximum number of log files in the config parameter 2023-11-22 18:35:21 +11:00
AP_MSP AP_MSP: update option metadata for clarity 2023-11-21 10:05:56 +11:00
AP_Math AP_Math: add F_TO_KELVIN and C_TO_F 2023-11-17 13:09:02 +11:00
AP_Menu
AP_Mission AP_Mission: Add is_valid_index() function 2023-11-14 10:22:45 +11:00
AP_Module
AP_Motors AP_Motors: example: support setting and testing DUAL_MODE 2023-11-14 10:25:11 +11:00
AP_Mount AP_Mount: validate modes before setting them 2023-11-17 11:45:38 +11:00
AP_NMEA_Output AP_NMEA_Output: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_NavEKF AP_NavEKF: fallback to no baro on boards that have no baro 2023-08-23 18:25:26 +10:00
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: do not use fmaxF on floating point values 2023-09-12 09:47:17 +10:00
AP_Navigation
AP_Networking AP_Networking: add support for AP_Periph 2023-11-26 11:28:57 +11:00
AP_Notify AP_Notify: document IS31FL3195 LED type for LED_TYPES parameter 2023-11-15 10:51:08 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF
AP_OSD AP_OSD:correct xy limits for panels 2023-11-12 07:08:28 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: increase scaler param desc ranges 2023-11-14 10:57:30 +11:00
AP_Parachute AP_Parachute: Change to Boolean value 2023-11-11 09:06:42 +09:00
AP_Param AP_Param: Allow override of AP_PARAM_DYNAMIC_ENABLED define 2023-10-17 10:23:20 +11:00
AP_PiccoloCAN AP_PiccoloCAN: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Proximity AP_Proximity: Minor fixes to LD06 driver 2023-10-05 08:23:00 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: prevent decoding past end of output array 2023-10-13 09:42:25 +11:00
AP_RCTelemetry AP_RCTelemetry: throttle CRSF request RX device info messages 2023-11-14 10:36:56 +11:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI AP_RSSI: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_RTC AP_RTC: remove code if AP_RTC_ENABLED is false 2023-10-11 19:17:27 +11:00
AP_Radio
AP_Rally AP_Rally: add alt_frame to unused flag bits 2023-11-01 19:06:39 +11:00
AP_RangeFinder AP_RangeFinder: Add signal_quality_pct to range finder state 2023-11-21 22:24:12 +11:00
AP_Relay AP_Relay: make set() method public 2023-11-17 13:09:02 +11:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Scripting AP_Scripting: change some _INFO msgs to _CRITICAL/ERROR 2023-11-22 00:07:05 -08:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: enable port registration for dronecan 2023-11-22 17:19:12 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: fix disable if second point fails to add 2023-09-19 08:01:47 +09:00
AP_Soaring
AP_Stats AP_Stats: initialise parameter defaults 2023-11-22 21:43:00 -08:00
AP_TECS TECS: move to new `using_airspeed_sensor` ahrs method 2023-10-31 10:39:21 +11:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
AP_TemperatureSensor AP_TempratureSensor: add support for analog sensor with polynomial 2023-10-04 18:28:09 +11:00
AP_Terrain AP_Terrain: add get_grid_spacing accessor 2023-11-02 15:54:37 +11:00
AP_Torqeedo AP_Torqeedo: error code reporting fix 2023-09-12 08:44:39 +10:00
AP_Tuning AP_Tuning: add and use AP_TUNING_ENABLED 2023-09-21 07:07:58 +10:00
AP_Vehicle AP_Vehicle: correct AP_Filter defines 2023-11-21 21:13:42 +11:00
AP_VideoTX AP_VideoTX:add additional freq bands 2023-09-13 18:05:24 +10:00
AP_VisualOdom AP_VisualOdom: visualodom requires DCM to work 2023-09-27 08:00:54 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: update for new AC_PID settings 2023-11-21 13:26:23 +11:00
AP_Winch AP_Winch: pos control user output fix 2023-10-31 10:37:45 +11:00
AP_WindVane AP_WindVane: Change from DOS to UNIX line endings 2023-09-08 17:09:26 +10:00
AR_Motors AR_Motors: Add prearm check for no outputs 2023-11-27 08:31:31 +09:00
AR_WPNav
Filter Filter: correct AP_Filter defines 2023-11-21 21:13:42 +11:00
GCS_MAVLink AP_RangeFinder: Add signal_quality_pct to range finder state 2023-11-21 22:24:12 +11:00
PID
RC_Channel RC_Channel: unfriend SRV_Channels 2023-11-11 08:42:04 +09:00
SITL SITL: Bump up read rate on SITL 2023-11-21 15:29:46 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
doc
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00