ardupilot/libraries
Peter Barker caf1e33f17 GCS_MAVLink: make AHRS attitude member variables private 2024-01-14 12:47:47 +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: add reset and I term set flags to PIDInfo 2024-01-03 12:28:59 +09: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: ACCEL_C defaults to 2x ACCEL 2024-01-08 19:36:16 +09:00
APM_Control APM_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_ADC
AP_ADSB AP_ADSB: add missing includes 2024-01-11 15:29:54 +11:00
AP_AHRS AP_AHRS: make AHRS attitude member variables private 2024-01-14 12:47:47 +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: support external AHRS airspeed sensor 2023-12-17 09:47:30 +11:00
AP_Arming AP_Arming: remove entire airspeed_checks if AP_AIRSPEED_ENABLED is off 2024-01-10 18:33:41 +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: support logging state-of-health percentage 2024-01-10 18:38:25 +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: reimplement with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_CSVReader
AP_Camera AP_Camera:fix OPTIONS bitmask 2024-01-04 08:25:48 +09: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: make AHRS attitude member variables private 2024-01-14 12:47:47 +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: remove duplicate rgb_led set_timeout_ms and set_priority 2024-01-10 18:29:24 +11:00
AP_EFI AP_EFI: add missing include 2024-01-11 15:29:54 +11:00
AP_ESC_Telem AP_ESC_Telem: add missing include 2024-01-11 15:29:54 +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_Filesystem: allow for large file IOs 2024-01-05 06:52:11 -08: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_FrskyTelem: fixed warning on ESP32 2024-01-07 20:51:55 +11:00
AP_GPS Revert "AP_GPS: GSOF robust config parsing" 2023-11-28 16:09:46 +11:00
AP_Generator AP_Generator: correct compilation if GCS_SEND_TEXT not available 2024-01-04 20:48:23 +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: move simulated height_agl into fdm structure 2024-01-08 20:00:01 +11:00
AP_HAL_ChibiOS hwdef: added scripting to CubePilot-PPPGW 2024-01-12 19:06:49 -08:00
AP_HAL_ESP32 AP_HAL_ESP32: analog warning fix 2024-01-09 11:15:21 +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: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_HAL_SITL AP_HAL_SITL: move simulated height_agl into fdm structure 2024-01-08 20:00:01 +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_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: make AHRS attitude member variables private 2024-01-14 12:47:47 +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_L1_Control AP_L1_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_LTM_Telem
AP_Landing AP_Landing: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_LandingGear AP_LandingGear: remove unneeded relay include 2023-12-19 10:01:01 +11:00
AP_LeakDetector
AP_Logger AP_Logger: Write_PID: add reset and I terms set flags 2024-01-03 12:28:59 +09: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 AP_MISSION_ENABLED is false 2024-01-03 16:16:47 +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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_NMEA_Output AP_NMEA_Output: fixed NMEA output altitude 2024-01-02 20:59:50 +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_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: added address_to_str() for scripting 2024-01-12 19:06:49 -08: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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: correct names of variables in HereFlow OF driver 2024-01-10 09:44:58 +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: move simulated height_agl into fdm structure 2024-01-08 20:00:01 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: bootstrap Ghost to correct baudrate 2024-01-10 18:32:53 +11:00
AP_RCTelemetry AP_RCTelemetry: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
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: allow to build on periph 2024-01-10 18:29:24 +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: correct compilation when AP_Vehicle not available 2023-12-13 18:34:40 +11:00
AP_Scripting AP_Scripting: document networking bindings 2024-01-12 19:06:49 -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: added PPP serial type 2024-01-03 12:14:47 +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: correct compilation when GCS library not available 2023-12-12 11:41:47 +11:00
AP_Soaring AP_Soaring: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Stats AP_Stats: initialise parameter defaults 2023-11-22 21:43:00 -08:00
AP_TECS AP_TECS: make AHRS attitude member variables private 2024-01-14 12:47:47 +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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11: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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AR_Motors AR_Motors: fix prearm for omni outputs 2024-01-10 09:47:03 +09: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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
PID
RC_Channel RC_Channel: add Ghost and DroneCAN to list of enabled protocols 2024-01-10 18:32:53 +11:00
SITL SITL: SIM_Frame: fixed per_motor_vars config loading 2024-01-09 10:53:33 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
doc
COLCON_IGNORE