5
0
mirror of https://github.com/ArduPilot/ardupilot synced 2025-03-13 10:03:57 -03:00
ardupilot/libraries
2025-03-11 12:28:25 +11:00
..
AC_AttitudeControl AC_PosControl: add get_vel_target and get_accel_target 2024-12-18 18:28:12 +11:00
AC_Autorotation AC_Autorotation: Mode restructure and speed controller improvement 2025-01-22 18:53:44 +11:00
AC_AutoTune AC_AutoTune_Heli: fix rate and accel limiting 2025-01-06 16:23:37 -05:00
AC_Avoidance AC_Avoidance: add missing AP_AHRS.h include 2025-03-01 10:58:24 +09:00
AC_CustomControl
AC_Fence AC_Fence: add AUTOLAND as FENCE_ACTION 2025-03-11 11:21:20 +11:00
AC_InputManager
AC_PID AC_PID: AC_P_2D comment fix 2024-10-04 09:25:56 +09:00
AC_PrecLand AP_IRLock: tidy up inclusions to match standards 2025-02-12 16:15:40 +09:00
AC_Sprayer
AC_WPNav AC_Loiter: Add method to change Loiter horizontal maximum speed 2025-02-11 08:35:34 +09:00
AP_AccelCal AP_AccelCal: Remove an unusable return 2025-02-28 11:00:29 +00:00
AP_ADC AP_ADC: remove variable dead stores 2025-01-30 08:47:34 +11:00
AP_ADSB AP_ADSB: clarify ADSB_LIST_ALT docs 2025-03-07 09:08:32 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: fix singleton panic message 2024-12-15 23:38:24 +11:00
AP_AHRS global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Airspeed AP_Airspeed: move calibration state into calibration state struct 2025-03-10 20:43:43 +11:00
AP_AIS global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Arming AP_Arming: add reset_all_aux_auths 2025-02-25 11:19:59 +11:00
AP_Avoidance
AP_Baro AP_Baro: Determine the result of the device data reading process 2025-03-10 21:38:57 +11:00
AP_BattMonitor global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Beacon AP_Beacon: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_BLHeli AP_BLHeli: fixed documentation for SERVO_BLH_3DMASK and SERVO_BLH_RVMASK 2025-02-13 11:22:50 +01:00
AP_BoardConfig global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Button AP_Button: set source index when running aux functions 2024-12-24 11:34:07 +11:00
AP_Camera global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_CANManager AP_CANManager: mark many functions as __INITFUNC__ 2025-02-19 18:01:48 +11:00
AP_CheckFirmware
AP_Common AP_Common: Add cont array constructor to AP_Bitmask 2025-01-08 08:52:21 +11:00
AP_Compass global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_CSVReader
AP_CustomRotations
AP_DAL AP_DAL: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_DDS AP_DDS: Navsat sending all available instances 2025-03-05 09:15:48 +11:00
AP_Declination AP_Declination: mark declination tables as __EXTFLASHFUNC__ 2025-02-19 18:01:48 +11:00
AP_Devo_Telem AP_Devo_Telem: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_DroneCAN global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_EFI global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_ESC_Telem AP_ESC_Telem: fix timeout race 2025-02-05 18:54:29 +11:00
AP_ExternalAHRS global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_ExternalControl AP_ExternalControl: arm through external control 2024-11-17 21:05:59 +11:00
AP_FETtecOneWire global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Filesystem AP_Filesystem: LittleFS: tune for JEDEC NOR 2025-03-04 11:46:15 +11:00
AP_FlashIface
AP_FlashStorage AP_FlashStorage: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_Follow AP_Follow: use set_alt_m when possible 2024-11-08 10:54:39 +11:00
AP_Frsky_Telem AP_Frsky_Telem: remove dead variable write 2025-01-29 21:41:51 +11:00
AP_Generator AP_Generator: FuelCell: increase max data rate limit 2025-03-04 11:03:03 +11:00
AP_GPS AP_GPS: remove SBP raw logging 2025-03-11 12:23:15 +11:00
AP_Gripper
AP_GSOF AP_GSOF: refactor GSOF to expect packets by ID 2025-01-08 08:52:21 +11:00
AP_GyroFFT AP_GyroFFT: mark many functions as __INITFUNC__ 2025-02-19 18:01:48 +11:00
AP_HAL AP_HAL: add logging of dropped incoming serial data 2025-03-11 12:28:25 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add logging of dropped incoming serial data 2025-03-11 12:28:25 +11:00
AP_HAL_Empty AP_HAL_Empty: add get_device-ptr to HAL DeviceMananger API 2025-03-11 12:00:22 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: add get_device-ptr to HAL DeviceMananger API 2025-03-11 12:00:22 +11:00
AP_HAL_Linux AP_HAL_Linux: add get_device-ptr to HAL DeviceMananger API 2025-03-11 12:00:22 +11:00
AP_HAL_QURT AP_HAL_QURT: add get_device-ptr to HAL DeviceMananger API 2025-03-11 12:00:22 +11:00
AP_HAL_SITL AP_HAL_SITL: add get_device-ptr to HAL DeviceMananger API 2025-03-11 12:00:22 +11:00
AP_Hott_Telem global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_IBus_Telem global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_ICEngine AP_ICEngine: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Remove two unused defines 2025-03-10 15:21:34 +11:00
AP_InternalError AP_InternalError: move methods for stack overflow and memguard to AP_HAL/Util 2025-02-27 20:11:40 +11:00
AP_IOMCU AP_IOMCU: remove unused dsmMode param from start_bind methods 2025-03-05 23:47:19 -05:00
AP_IRLock AP_IRLock: tidy up inclusions to match standards 2025-02-12 16:15:40 +09:00
AP_JSButton
AP_JSON
AP_KDECAN global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_L1_Control AP_L1_Control: Fix NAVL1_PERIOD description typo 2025-01-30 20:53:17 +11:00
AP_Landing global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: use AP::RC() directly to get detected protocol name 2025-03-05 23:47:19 -05:00
AP_LTM_Telem global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Math AP_Math: allow initial value to be specified for crc8_generic 2025-03-05 18:17:28 +11:00
AP_Menu
AP_Mission AP_Mission: fix option_is_set 2025-03-05 19:09:52 +09:00
AP_Module
AP_Motors AP_Motors: MOT_THST_HOVER param desc min/max fixed 2025-03-10 19:28:15 +09:00
AP_Mount global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_MSP
AP_MultiHeap AP_MultiHeap: initialize only if heap allocation succeeded 2025-01-05 10:27:32 +11:00
AP_NavEKF AP_NavEKF3: move definition of MAX_EKF_CORES 2024-12-31 10:55:51 +11:00
AP_NavEKF2 AP_NavEKF2: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_NavEKF3 AP_NavEKF3: document variance state fields 2025-03-05 09:16:10 +11:00
AP_Navigation
AP_Networking AP_Networking: make can multicast an endpoint by default 2025-02-05 10:23:46 +11:00
AP_NMEA_Output global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Notify AP_Notify: stop using OwnPtr in IS31FL3195 2025-03-05 18:18:11 +11:00
AP_OLC global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_ONVIF
AP_OpenDroneID
AP_OpticalFlow AP_OpticalFlow: mark Pixart init data as __INITFUNC__ 2025-03-06 12:35:46 -05:00
AP_OSD AP_OSD: add option for IOMCU SerialProtocol 2025-02-27 20:11:40 +11:00
AP_Parachute
AP_Param global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_PiccoloCAN AP_PiccoloCAN: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_Proximity AP_Proximity: correct compialtion when hexsoon radar not compiled in 2025-03-09 11:16:38 +11:00
AP_Quicktune AP_Quicktune: adjust defaults 2024-11-27 14:07:38 +11:00
AP_Radio AP_Radio: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: add Hexsoon 24G Radar support 2025-03-10 15:02:57 +09:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: use NEW_NOTHROW on emlid RCIO backend 2025-03-05 23:47:19 -05:00
AP_RCTelemetry global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Relay AP_Relay: move defaulting of relay pin params to linux hwdefs 2025-02-19 15:42:52 +11:00
AP_RobotisServo global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_ROMFS
AP_RPM AP_RPM: use AP_PERIPH_RPM_ENABLED and AP_PERIPH_RPM_STREAM_ENABLED 2025-02-13 20:29:06 +11:00
AP_RSSI
AP_RTC AP_RTC: correct logger documentation 2024-11-22 10:18:31 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: log RTC into PM message 2024-11-21 09:19:38 +11:00
AP_Scripting AP_Scripting: don't provide handle_external_position_estimate if not AP_AHRS_EXTERNAL_ENABLED 2025-03-09 11:16:38 +11:00
AP_SerialLED AP_SerialLED: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_SerialManager AP_SerialManager: add support for SerialProtocol_IOMCU 2025-02-27 20:11:40 +11:00
AP_Servo_Telem AP_Servo_Telem: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: Rate limit the NVF publishers to 4Hz 2025-01-28 17:22:28 +11:00
AP_Stats
AP_SurfaceDistance AP_SurfaceDistance: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_TECS AP_TECS: Corrected formula for _TASmin according to fix in formula for the load factor 2025-02-18 10:53:06 +11:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: add support for SHT3x-DIS temperature sensor 2025-03-05 18:17:28 +11:00
AP_Terrain AP_Terrain: Add const to locals 2024-11-26 15:42:04 +11:00
AP_Torqeedo global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Tuning AP_Tuning: Bugfix 2025-01-21 11:19:37 +11:00
AP_Vehicle AP_Vehicle: set iomcu serialmanager protocol if iomcu is enabled 2025-02-27 20:11:40 +11:00
AP_VideoTX global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_VisualOdom global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_Volz_Protocol global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
AP_WheelEncoder
AP_Winch
AP_WindVane
APM_Control APM_Control: examples: AP_FW_Controller_test: update to use HAL SITL 2025-02-04 10:41:56 +11:00
AR_Motors AR_Motors: fix brushed motor support for omni vehicles 2025-02-11 09:21:16 +09:00
AR_WPNav
doc
Filter global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
GCS_MAVLink GCS_MAVLink: let GCS_MAVLink handle follow packets 2025-03-11 09:03:32 +09:00
PID
RC_Channel RC_Channel: bind receivers directly via AP_RCProtocol library 2025-03-05 23:47:19 -05:00
SITL SITL: correct instructions on how to use JSON interface 2025-03-10 19:40:03 +11:00
SRV_Channel global: create and use HAL_PROGRAM_SIZE_LIMIT_KB 2025-02-26 10:06:39 +11:00
StorageManager
COLCON_IGNORE