ardupilot/libraries
Peter Barker f83b561566 AP_HAL_SITL: guard against DSP being compiled out of code 2024-01-03 11:45:31 +11:00
..
AC_AttitudeControl AC_AttitudeControl: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AC_AutoTune AC_AutoTune: add and use header guards 2023-12-12 11:36:15 +11:00
AC_Autorotation AC_Autorotation: Fix some typos 2023-10-12 18:30:42 +11:00
AC_Avoidance AC_Avoidance: Dijsktras comment and const fix 2023-12-28 08:45:23 +09:00
AC_CustomControl AP_CustomControl: use base class AC_AttitudeControl object 2023-12-05 08:08:09 +09:00
AC_Fence AC_Fence:expand FENCE_AUTOENABLE description 2024-01-02 10:52:45 +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: OA supports fast waypoints with dijkstras 2023-12-28 08:45:23 +09:00
APM_Control AR_PosControl: no min speed when stopping 2023-11-28 12:46:46 +09:00
AP_ADC
AP_ADSB AP_ADSB: fixed a crash in ADSB when baro not healthy 2024-01-02 08:12:37 +11:00
AP_AHRS AP_AHRS: Don't Switch to DCM to get Better GPS if DCM Isn't Using GPS 2024-01-01 13:16:04 +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_Airspeed AP_Airspeed: support external AHRS airspeed sensor 2023-12-17 09:47:30 +11:00
AP_Arming AP_Arming: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Avoidance AP_Avoidance: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_BLHeli AP_BLHeli: allow bdshot iomcu on non-bdshot fmu 2023-12-18 19:02:52 +11:00
AP_Baro AP_Baro: slow down Baro offset slew 2023-12-26 10:17:56 +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_CANManager AP_CANManager: reimplement with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_CSVReader
AP_Camera AP_Camera: move to new relay functions 2023-12-19 10:01:01 +11:00
AP_CheckFirmware
AP_Common AP_Common: Define units for locatoin data members 2023-12-20 02:37:01 +00:00
AP_Compass AP_Compass: use tesla conversion from AP_Math/definitions.h 2023-12-17 09:47:30 +11:00
AP_CustomRotations
AP_DAL AP_DAL: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_DDS AP_DDS: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: reimplement with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_EFI AP_EFI : Hirth Driver Addition 2023-11-17 13:09:02 +11:00
AP_ESC_Telem AP_ESC_Telem: allow IOMCU to work in example fw 2024-01-02 08:12:37 +11:00
AP_ExternalAHRS AP_ExternalAHRS: add InertialLabs to type parameter 2024-01-01 13:18:08 +11:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: remove references to legacy UART order 2023-12-19 06:53:15 +11:00
AP_Filesystem AP_RTC: fixed build on arm 2023-12-11 18:00:38 +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: correct defaulting of AP_FOLLOW_ENABLED 2023-12-08 22:52:18 +11:00
AP_Frsky_Telem AP_Frsky_Telem: Fix some typos 2023-10-12 18:30:42 +11:00
AP_GPS Revert "AP_GPS: GSOF robust config parsing" 2023-11-28 16:09:46 +11:00
AP_Generator AP_Gernerator: FuelCell: rework error check to give error cleared msg 2023-11-28 11:27:14 +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: added BinarySemaphore test 2024-01-03 07:37:05 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: reimplement CAN with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_HAL_ESP32 HAL_ESP32: implement BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_HAL_Empty AP_HAL_Empty: eliminate legacy UART ordering/references 2023-12-19 06:53:15 +11:00
AP_HAL_Linux HAL_Linux: reimplement CAN with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_HAL_SITL AP_HAL_SITL: guard against DSP being compiled out of code 2024-01-03 11:45:31 +11: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: add support for starter relay 2023-12-20 19:29:50 +11:00
AP_IOMCU AP_IOMCU: fix occasional startup internal errors with mixing 2023-12-24 14:39:05 +11:00
AP_IRLock
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: added support for writing raw IMU data to a UART 2023-11-30 07:05:02 +11:00
AP_InternalError
AP_JSButton AP_JSButton: reserve 4 button functions for script access 2023-09-27 08:14:36 +10:00
AP_KDECAN
AP_L1_Control
AP_LTM_Telem
AP_Landing AP_Landing: move wind helper functions to AP_AHRS 2023-12-26 10:20:23 +11:00
AP_LandingGear AP_LandingGear: remove unneeded relay include 2023-12-19 10:01:01 +11:00
AP_LeakDetector
AP_Logger AP_Logger: correct compilation with AP_RSSI disabled 2023-12-13 18:30:32 +11:00
AP_MSP AP_MSP: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_Math AP_Math: added uint64_div1000() 2023-12-21 09:09:11 +11:00
AP_Menu
AP_Mission AP_Mission: correct compilation when RC_Channel not enabled 2023-12-12 14:52:36 +11:00
AP_Module
AP_Motors AP_Motors:expand heli tail param metadata 2023-12-20 17:50:38 -05:00
AP_Mount AP_Mount: validate modes before setting them 2023-11-17 11:45:38 +11:00
AP_NMEA_Output AP_NMEA_Output: fixed NMEA output altitude 2024-01-02 20:59:50 +11:00
AP_NavEKF
AP_NavEKF2
AP_NavEKF3
AP_Navigation
AP_Networking AP_Networking: added sendfile() 2023-12-11 18:00:38 +11:00
AP_Notify AP_Notify: ensure dshot LEDs work with EDT ESCs 2023-12-18 19:02:52 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF
AP_OSD AP_OSD: correct compilation when RC_Channels library not available 2023-12-12 14:35:12 +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:upate metadata in line with new relay functions 2024-01-02 11:46:46 +11:00
AP_Param AP_Param: check dynamic param tables are avalable before adding a param 2023-11-28 11:22:43 +11:00
AP_PiccoloCAN AP_PiccoloCAN: reimplement with BinarySemaphore 2024-01-03 07:37:05 +11: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: rename crc_sum8 to crc_sum8_with_carry 2023-11-29 18:50:26 +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_RSSI AP_RSSI: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_RTC AP_RTC: added time and date APIs for lua 2023-12-11 18:00:38 +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 LUA interface to access Range Finder state 2024-01-02 11:31:02 +11:00
AP_Relay AP_Relay:correct function param metadata 2023-12-26 22:28:37 -07:00
AP_RobotisServo
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Scripting AP_Scripting: Add LUA interface to access Range Finder state 2024-01-02 11:31:02 +11: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: expose HAVE_SERIAL_xxx in config 2023-12-27 05:13:14 -07:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: correct compilation when GCS library not available 2023-12-12 11:41:47 +11: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_Tuning AP_Tuning: add and use AP_TUNING_ENABLED 2023-09-21 07:07:58 +10:00
AP_Vehicle AP_Vehicle: Set position target depends on ext control 2023-12-20 02:37:01 +00:00
AP_VideoTX AP_VideoTX: Restore use of the VTX_MAX_POWER parameter 2024-01-02 12:00:22 +11:00
AP_VisualOdom AP_VisualOdom: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11: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: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AR_Motors AR_Motors: fix support for omni vehicles 2024-01-02 11:27:53 +11:00
AR_WPNav AR_WPNav: send next destination to OA 2023-12-28 08:45:23 +09:00
Filter Filter: fixed uint8_t bug in total filters and expand_filter_count bug 2023-11-28 18:05:37 +11:00
GCS_MAVLink GCS_MAVLink: return MAV_RESULT_COMMAND_INT_ONLY if command-long support not compiled in 2024-01-02 18:58:07 +11:00
PID
RC_Channel RC_Channel: use EKFType enum class 2023-12-17 09:47:30 +11:00
SITL SITL: fixed running example firmwares 2024-01-02 08:12:37 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
doc
COLCON_IGNORE