ardupilot/libraries
2023-02-08 16:25:39 +11:00
..
AC_AttitudeControl AC_AttitudeControl: move THR_G_BOOST to Multicopter only 2023-01-31 08:22:40 +09:00
AC_Autorotation
AC_AutoTune AC_AutoTune: Tradheli-modify I gain for angle p and tune check 2023-01-31 10:10:59 -05:00
AC_Avoidance AC_Avoidance: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_CustomControl
AC_Fence AC_Fence: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_InputManager
AC_PID AC_PID: AC_PI: fix param defualting 2023-02-06 08:09:13 +09:00
AC_PrecLand AC_Precland: Add option to resume precland after manual override 2023-01-31 19:56:43 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: Fix Bug to use WPNAV_ACCEL_C 2023-01-28 08:11:51 +09:00
AP_AccelCal
AP_ADC
AP_ADSB AP_ADSB: create AP_ADSB_config.h 2023-01-31 11:11:26 +11:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: move AP_NMEA_OUTPUT to a first class library 2023-02-07 21:12:07 +11:00
AP_Airspeed
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Arming AP_Arming: use check_enabked hepler to always check if all bit is set 2023-01-24 11:09:51 +11:00
AP_Avoidance
AP_Baro AP_Baro: allow enabling of only some ExternalAHRS sensors 2023-01-30 09:22:02 +11:00
AP_BattMonitor AP_BattMonitor: rename has_fuel_remaining to has_fuel_remaining_pct 2023-02-02 16:16:05 +11:00
AP_Beacon
AP_BLHeli
AP_BoardConfig AP_BoardConfig: improve description of BRD_PWM_VOLT_SEL 2023-01-31 11:13:35 +11:00
AP_Button
AP_Camera AP_Camera: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_CANManager AP_CANManager: check for alloc failure of ObjectBuffer 2023-01-08 15:11:32 +11:00
AP_CheckFirmware
AP_Common AP_Common: add NMEA output to a buffer 2023-02-07 21:12:07 +11:00
AP_Compass AP_Compass: add and use AP_COMPASS_AK8963_ENABLED 2023-02-07 10:21:06 +11:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_CustomRotations
AP_DAL AP_DAL: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: correct EFI ignition_voltage flag values 2023-02-07 10:40:50 +11:00
AP_ESC_Telem AP_ESC_Telem: simplify AP_TemperatureSensor integration 2023-01-31 10:52:23 +11:00
AP_ExternalAHRS AP_ExternalAHRS: added EAHRS_SENSORS parameter 2023-01-30 09:22:02 +11:00
AP_FETtecOneWire
AP_Filesystem
AP_FlashIface
AP_FlashStorage
AP_Follow
AP_Frsky_Telem
AP_Generator AP_Generator: rename has_fuel_remaining to has_fuel_remaining_pct 2023-02-02 16:16:05 +11:00
AP_GPS AP_GPS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Gripper AP_Gripper: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_GyroFFT AP_GyroFFT: change default FFT frequency range to something more useful 2023-01-24 10:56:33 +11:00
AP_HAL AP_HAL: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_HAL_ChibiOS A_HAL_ChibiOS: add HAL_NMEA_OUTPUT_ENABLED 0 2023-02-07 21:12:07 +11:00
AP_HAL_Empty
AP_HAL_ESP32 AP_HAL_ESP32: Readme update 2023-01-31 18:00:25 +11:00
AP_HAL_Linux AP_HAL_Linux: added old_size to heap_realloc 2023-01-16 09:19:16 +11:00
AP_HAL_SITL AP_HAL_SITL: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Hott_Telem
AP_ICEngine
AP_InertialNav
AP_InertialSensor AP_InertialSensor: allow enabling of only some ExternalAHRS sensors 2023-01-30 09:22:02 +11:00
AP_InternalError
AP_IOMCU
AP_IRLock
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Landing AP_Landing: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: add unit 'y' for litres/second 2023-02-02 11:42:04 +11:00
AP_LTM_Telem
AP_Math AP_Math: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Menu
AP_Mission AP_Mission: Match variable types 2023-02-07 08:56:28 +09:00
AP_Module
AP_Motors AP_MotorsHeli: better governor power recovery from autorotation 2023-02-05 17:54:33 -05:00
AP_Mount AP_Mount: add scripting backend 2023-01-31 17:20:37 +09:00
AP_MSP
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NavEKF3 AP_NavEKF3: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NMEA_Output AP_NMEA_Output: add params and optimized 2023-02-07 21:12:07 +11:00
AP_Notify AP_Notify: Match value types 2023-01-31 17:59:55 +11:00
AP_OLC
AP_ONVIF
AP_OpenDroneID AP_OpenDroneID: set EMERGENCY status on crash or chute deploy 2023-01-17 10:31:26 +11:00
AP_OpticalFlow
AP_OSD AP_OSD: add support for AP_VIDEOTX_ENABLED 2023-02-07 16:54:40 +11:00
AP_Parachute
AP_Param AP_Param: print length of defaults list as part of key dump 2023-01-24 10:16:56 +11:00
AP_PiccoloCAN
AP_Proximity
AP_Radio
AP_Rally
AP_RAMTRON
AP_RangeFinder
AP_RCMapper
AP_RCProtocol AP_RCProtocol: on IOMCU don't allow protocol to change once detected 2023-02-08 10:08:23 +11:00
AP_RCTelemetry AP_RCTelemetry: add support for AP_VIDEOTX_ENABLED 2023-02-07 16:54:40 +11:00
AP_Relay
AP_RobotisServo
AP_ROMFS
AP_RPM
AP_RSSI
AP_RTC
AP_SBusOut
AP_Scheduler AP_Scheduler: added ticks32() API 2023-01-29 15:28:43 +11:00
AP_Scripting AP_Scripting: add bindings for E-stop, Interlock and Safety state 2023-02-07 10:24:18 +11:00
AP_SerialLED
AP_SerialManager
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring
AP_Stats
AP_TECS AP_Landing: Add Landing Max Throttle Option 2023-01-24 10:19:56 +11:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor:correct TEMP sensor metadata 2023-01-24 11:16:51 +11:00
AP_Terrain AP_Terrain: Explicitly state that they are at the same latitude 2023-02-08 08:54:35 +11:00
AP_Torqeedo
AP_Tuning
AP_UAVCAN AP_UAVAN: pass error_count from ESC Status packet to AP_ESC_Telem 2023-02-07 10:39:16 +11:00
AP_Vehicle AP_Vehicle: added set_rudder_offset() 2023-02-08 16:25:39 +11:00
AP_VideoTX AP_VideoTX: learn all the power levels when using SmartAudio 2.0 2023-01-31 11:23:59 +11:00
AP_VisualOdom AP_VisualOdom: handle voxl yaw and pos jump on reset 2023-01-24 11:07:02 +11:00
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch AP_Winch: tidy includes of SRV_Channel.h 2023-01-25 22:30:55 +11:00
AP_WindVane
APM_Control AMP_Control: Roll and Pitch Controller: don't reset pid_info.I in reset_I calls 2023-01-17 11:19:39 +11:00
AR_Motors
AR_WPNav AR_WPNav: avoid using struct Location 2023-02-04 22:51:54 +11:00
doc
Filter Filter: save freq_min_ratio when saving parameters 2023-01-31 10:58:12 +11:00
GCS_MAVLink GCS_MAVLink: tidy valid-channel check in set_message_interval 2023-02-07 10:07:39 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel: add support for AP_VIDEOTX_ENABLED 2023-02-07 16:54:40 +11:00
SITL SITL: fix heli RPM for heli SITL models 2023-02-07 11:05:29 +11:00
SRV_Channel SRV_Channel: narrow include for configuration 2023-01-25 22:30:55 +11:00
StorageManager