ardupilot/libraries
2024-10-16 10:47:47 +09:00
..
AC_AttitudeControl AC_PosControl: always update yaw targets 2024-04-30 20:29:20 +09:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: zero out D_FF during twitching 2024-05-16 10:59:52 +10:00
AC_Avoidance AC_Avoid: add "BACKZ_SPD" vertical backup speed limit parameter 2024-05-16 10:59:51 +10:00
AC_CustomControl
AC_Fence AC_Fence: allow for fence storage on microSD 2024-03-14 09:33:55 +09:00
AC_InputManager all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_PID AC_PID: correct error caculation to use latest target 2024-08-21 20:39:44 +09:00
AC_PrecLand
AC_Sprayer
AC_WPNav
AP_AccelCal
AP_ADC
AP_ADSB
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: don't use accel/gyro from ExternalAHRS unless enabled 2024-03-14 09:33:55 +09:00
AP_Airspeed
AP_AIS
AP_Arming AP_Arming: added eeprom full arming check 2024-07-03 10:31:14 +09:00
AP_Avoidance
AP_Baro AP_Baro: Add in BMP581 Driver 2024-08-21 20:39:44 +09:00
AP_BattMonitor AP_BattMonitor: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Beacon AP_Beacon: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_BLHeli
AP_BoardConfig AP_BoardConfig: added BRD_SD_FENCE 2024-03-14 09:33:55 +09:00
AP_Button
AP_Camera AP_Camera: proper string formatting 2024-08-21 20:39:44 +09:00
AP_CANManager
AP_CheckFirmware
AP_Common
AP_Compass AP_Compass: removed IST8310 overrun message 2024-07-03 10:31:14 +09:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_CustomRotations
AP_DAL AP_DAL: visual odom get_delay_ms return fix 2024-04-30 20:29:20 +09:00
AP_DDS AP_DDS: Correct compilation of tests without external odom 2024-09-27 14:19:56 +09:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_DroneCAN AP_DroneCAN: Fix constructor initialization order 2024-09-27 14:19:56 +09:00
AP_EFI AP_EFI: add missing include 2024-01-11 15:29:54 +11:00
AP_ESC_Telem AP_ESC_Telem: use highest ESC temp rather than motor temp 2024-08-21 20:39:44 +09:00
AP_ExternalAHRS AP_ExternalAHRS: Fix duplicate condition 2024-07-03 10:31:14 +09:00
AP_ExternalControl
AP_FETtecOneWire
AP_Filesystem AP_Filesystem: remove unused variables 2024-08-21 20:39:44 +09: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: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Frsky_Telem
AP_Generator
AP_GPS AP_GPS: revert backport to copter 4.5 the correct satellite count for NrSv do-not-use value 2024-10-16 10:47:47 +09:00
AP_Gripper
AP_GyroFFT
AP_HAL AP_HAL: make NeoPixel high-low proportions match for 0 and 1 2024-05-16 10:59:51 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: correctly uninvert RX/TX on F4 with inverter support 2024-09-27 14:19:56 +09:00
AP_HAL_Empty
AP_HAL_ESP32 AP_HAL_ESP32: fixed get_baud_rate() 2024-03-14 09:33:55 +09:00
AP_HAL_Linux AP_HAL_Linux: fixed get_baud_rate() 2024-03-14 09:33:55 +09:00
AP_HAL_SITL AP_HAL_SITL: fixed get_baud_rate() 2024-03-14 09:33:55 +09: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_InertialNav
AP_InertialSensor AP_InertialSensor: Check the gyro/accel id has not been previously registered 2024-08-21 20:39:44 +09:00
AP_InternalError AP_InternalError: improve gating of use of AP_InternalError library 2023-08-17 09:16:46 +10:00
AP_IOMCU AP_IOMCU: add GPIO mask getter and GPIO virtual read 2024-08-21 20:39:44 +09:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_JSButton
AP_KDECAN AP_KDECAN: move and rename CAN Driver_Type enumeration 2023-04-20 08:53:46 +10:00
AP_L1_Control
AP_Landing
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: correctly read file header for block logger 2024-08-21 20:39:44 +09:00
AP_LTM_Telem AP_LTM_Telem: correct compilation when AP_AHRS_ENABLED is off 2024-01-16 16:14:04 +11:00
AP_Math
AP_Menu
AP_Mission AP_Mission: emit jump count even if no limit 2024-07-03 10:31:14 +09:00
AP_Module
AP_Motors AP_Motors: fix DDVP tail servo initialization 2024-09-27 14:19:56 +09:00
AP_Mount AP_Mount: squash static_assert warnings 2024-08-21 20:39:44 +09:00
AP_MSP AP_MSP: use highest ESC temp rather than motor temp 2024-08-21 20:39:44 +09:00
AP_NavEKF
AP_NavEKF2
AP_NavEKF3 AP_NavEKF3: Adjust sensor height when EK3_OGN_HGT_MASK bit 2 is set 2024-07-03 10:31:14 +09:00
AP_Navigation
AP_Networking AP_Networking: enable Socket IP reuse 2024-07-03 10:31:14 +09:00
AP_NMEA_Output AP_NMEA_Output: fixed NMEA output altitude 2024-01-02 20:59:50 +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 all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow
AP_OSD AP_OSD: use highest ESC temp rather than motor temp 2024-08-21 20:39:44 +09:00
AP_Parachute
AP_Param AP_Param: remove unused variable 2024-08-21 20:39:44 +09:00
AP_PiccoloCAN
AP_Proximity AP_Proximity: Include database push in MR72 driver 2024-09-27 14:19:56 +09:00
AP_Radio
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: fix Lua timeout 2024-05-16 10:59:52 +10:00
AP_RCMapper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RCProtocol AP_RCProtocol: only update rc value for GHST on rc frames 2024-09-27 14:19:56 +09:00
AP_RCTelemetry AP_RCTelemetry: use get_max_rpm_esc() 2024-07-03 10:31:14 +09:00
AP_Relay AP_Relay: send relay status for all relays with valid functions 2024-01-23 10:42:02 +11:00
AP_RobotisServo
AP_ROMFS
AP_RPM
AP_RSSI
AP_RTC AP_RTC: remove pointless assignment of total_delay_ms 2024-01-21 09:53:04 +11:00
AP_SBusOut
AP_Scheduler
AP_Scripting AP_Scripting: correct use-after-free in script statistics 2024-07-03 10:31:14 +09:00
AP_SerialLED
AP_SerialManager
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: add point made public 2024-08-21 20:39:44 +09:00
AP_Soaring
AP_Stats
AP_TECS AP_TECS: fixed adjusting speed without airspeed sensor 2024-03-14 09:33:55 +09:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
AP_TemperatureSensor
AP_Terrain AP_Terrain: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Torqeedo
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle
AP_VideoTX AP_VideoTX: add autobauding to Tramp 2024-07-03 10:31:14 +09:00
AP_VisualOdom AP_VisualOdom: use Odometry quality 2024-03-14 09:33:55 +09:00
AP_Volz_Protocol AP_Volz_Protocol: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_WheelEncoder
AP_Winch AP_Winch: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_WindVane
APM_Control APM_Control: change LIM_ROLL_CD to ROLL_LIMIT_DEG 2024-01-23 15:00:30 +11:00
AR_Motors
AR_WPNav AR_WPNav: send next destination to OA 2023-12-28 08:45:23 +09:00
doc
Filter Filter: HarmonicNotchFilter: convert harmonics as a bitmask 2024-04-30 20:29:20 +09:00
GCS_MAVLink GCS_MAVLink: Avoid serial passthrough buffer exhausted/lost data 2024-05-01 15:47:27 +09:00
PID
RC_Channel RC_Channel: add mount LRF enable aux function 2024-04-30 20:29:20 +09:00
SITL SITL: correct valgrind failure in SIM_GPS_SBP 2024-08-21 20:39:44 +09:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
COLCON_IGNORE