ardupilot/libraries
Tim Tuxworth 12f9fe9456 AP_AHRS: Correct/clarify AHRS_WIND_MAX description 2023-10-11 19:09:00 +11:00
..
AC_AttitudeControl AC_PosControl: Add monitoring and reporting of forward accel saturation 2023-09-27 11:43:45 +10:00
AC_AutoTune AC_AutoTune: remove unsued variables 2023-07-13 11:02:40 +10:00
AC_Autorotation
AC_Avoidance AC_Avoidance: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AC_CustomControl AC_CustomControl: Support PD Max 2023-09-26 10:41:05 +10:00
AC_Fence AC_Fence: Change the description to match the actual value(NFC) 2023-10-05 08:22:22 +11:00
AC_InputManager
AC_PID AC_PID: Simplify update_error method by calling update all 2023-10-03 11:27:07 +11:00
AC_PrecLand Copter: Allow fast descend while Prec Landing 2023-09-13 11:49:16 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: add roi circle_option metadata 2023-07-02 13:15:20 +10:00
APM_Control APM_Control: Support PD Max 2023-09-26 10:41:05 +10:00
AP_ADC
AP_ADSB AP_ADSB: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_AHRS AP_AHRS: Correct/clarify AHRS_WIND_MAX description 2023-10-11 19:09:00 +11:00
AP_AIS
AP_AccelCal AP_AccellCal: initialize HAL_INS_ACCELCAL_ENABLED for periph 2023-07-04 05:41:03 -07:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_Airspeed AP_Airspeed: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Arming AP_Arming: Don't allow same CAN rangefinder on different can bus 2023-09-09 17:21:44 +10:00
AP_Avoidance AP_Avoidance: Change division to multiplication 2023-10-05 08:19:14 +11:00
AP_BLHeli AP_BLHeli: normalize motor index correctly for iomcu running dshot 2023-08-15 06:53:48 +10:00
AP_Baro AP_Baro: Fix GCS DPS310 HWID issue 2023-09-27 08:11:52 +10:00
AP_BattMonitor Tools: allow Ohm units in parameters 2023-10-08 11:04:21 +11:00
AP_Beacon AP_Beacon: MarvelMind: avoid potentially reading INT32_MAX bytes of input 2023-07-18 11:18:47 +10:00
AP_BoardConfig AP_BoardConfig: control dshot availability with HAL_WITH_IO_MCU_DSHOT 2023-08-15 06:53:48 +10: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: handle CAN_FORWARD as both command_INT and COMMAND_LONG 2023-09-20 17:50:56 +10:00
AP_CSVReader
AP_Camera AP_Camera: image-stop-capture fix for instance 2023-09-26 10:53:22 +10:00
AP_CheckFirmware AP_CheckFirmware: fixed error code for bad firmware 2023-07-09 18:11:54 +10:00
AP_Common AP_Common: make Location.cpp compile without AP::ahrs() available 2023-10-04 18:10:58 +11:00
AP_Compass AP_Compass: use AP_GPS_ENABLED to exclude more code when GPS not compiled in 2023-09-27 16:38:15 +10:00
AP_CustomRotations
AP_DAL AP_DAL: add missing internalerror include 2023-09-03 08:41:10 +10:00
AP_DDS AP_DDS: use ROS convention for node name 2023-10-11 18:00:24 +11:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: support string parameters 2023-09-19 10:58:52 +10:00
AP_EFI AP_EFI: Rate limit the megasquirt driver 2023-10-03 11:32:07 +11:00
AP_ESC_Telem AP_ESC_Telem: fix fake value of SITL ESC 2023-09-11 09:48:34 +10:00
AP_ExternalAHRS AP_AHRS: fill in error string when invalid backend specified 2023-09-25 08:11:23 +10:00
AP_ExternalControl AP_ExternalControl: external control library for MAVLink,lua and DDS 2023-08-22 18:21:23 +10:00
AP_FETtecOneWire AP_FETtecOneWire: fixed build on periph 2023-08-24 13:06:40 +10:00
AP_Filesystem AP_Filesystem: move AP_RTC::mktime to be ap_mktime 2023-06-27 11:25:11 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: add and use AP_FOLLOW_ENABLED 2023-08-15 09:57:35 +10:00
AP_Frsky_Telem AP_Frsky_Telem: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_GPS AP_GPS: correct placement of voiding clause 2023-10-10 08:37:57 +09:00
AP_Generator AP_Generator: IE 650/800: does have fuel remaining 2023-09-26 10:47:50 +10:00
AP_Gripper AP_Gripper: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_GyroFFT AP_GyroFFT: update harmonics to uint32 2023-10-10 08:07:16 +09:00
AP_HAL AP_HAL: Add support for NeoPixelRGB 2023-10-04 18:06:17 +11:00
AP_HAL_ChibiOS AP_ChibiOS: Delete the same definition 2023-10-11 14:42:32 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: update esp32empty 2023-09-02 09:43:14 +10:00
AP_HAL_Empty AP_HAL_Empty: moved UART port locking up to AP_HAL 2023-07-12 17:06:02 +10:00
AP_HAL_Linux AP_HAL_Linux: make all semaphores priority-inherit 2023-09-06 15:58:58 -05:00
AP_HAL_SITL HAL_SITL: enable ADSB simulator in SITL periph 2023-10-02 21:45:28 +11:00
AP_Hott_Telem AP_Hott_Telem: removed set_blocking_writes 2023-07-12 17:06:02 +10:00
AP_ICEngine AP_ICEngine: minor OPTIONS param spelling fix 2023-09-27 08:43:27 -07:00
AP_IOMCU AP_IOMCU: fix eventing mask and some minor cleanups 2023-08-15 06:53:48 +10:00
AP_IRLock
AP_InertialNav AP_InertialNav: clarify get_vert_pos_rate AHRS method name to include 'D' 2023-06-06 20:09:28 +10:00
AP_InertialSensor AP_InertialSensor: call init for harmonic notch params 2023-10-10 08:07:16 +09: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: check vehicle yaw (heading) and ground track agree 2023-09-05 10:07:14 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Landing AP_Landing: trim LogStructure base off included code 2023-08-01 10:07:28 +10:00
AP_LandingGear AP_LandingGear: avoid use of MINIMIZE_FEATURES in AP_LandingGear_config.h 2023-08-01 10:44:59 +10:00
AP_LeakDetector
AP_Logger AP_RangeFinder: log signal quality 2023-10-11 08:29:58 +11:00
AP_MSP AP_MSP: remove references to HAL_BUILD_AP_PERIPH 2023-08-09 17:39:49 +10:00
AP_Math AP_Math: add CRC8_generic method 2023-10-05 08:23:00 +11:00
AP_Menu
AP_Mission AP_Mission: image-stop-capture fix for instance 2023-09-26 10:53:22 +10:00
AP_Module
AP_Motors AP_Motors: Add a seprate spool down time, if it's 0 use spool up time 2023-10-03 08:04:56 +09:00
AP_Mount AP_Mount: Xacti digital zoom percentage fix 2023-10-03 13:48:41 +09:00
AP_NMEA_Output AP_NMEA_Output: remove from 1MB boards 2023-08-15 08:45:30 +10: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_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: do not use fmaxF on floating point values 2023-09-12 09:47:17 +10:00
AP_Navigation
AP_Networking Update libraries/AP_Networking/AP_Networking.cpp 2023-08-22 09:25:42 -07:00
AP_Notify AP_Notify: add support for NeoPixelRGB via set_num_neopixel_rgb() 2023-10-04 18:06:17 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF
AP_OSD AP_OSD: Make per-cell voltage be shown to two decimal places again 2023-10-04 18:09:17 +11:00
AP_OpenDroneID AP_OpenDroneID: remove Chip ID as Basic ID mechanism 2023-06-17 14:49:22 +10:00
AP_OpticalFlow AP_OpticalFlow: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Parachute AP_Parachute: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Param AP_Param: fixed parameter defaults array length handling 2023-08-22 11:07:30 +10:00
AP_PiccoloCAN AP_PiccoloCAN: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10: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: disable raw logging if no RC_Channel 2023-10-03 11:46:43 +11:00
AP_RCTelemetry AP_RCTelemetry: remove some uses of gcs singleton 2023-10-03 09:47:38 +11:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI AP_RSSI: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_RTC AP_RTC: get-date-and-time returns milliseconds 2023-07-18 21:02:02 +09:00
AP_Radio
AP_Rally AP_Rally: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_RangeFinder AP_RangeFinder: change get_signal_quality signature to use int8_t 2023-10-11 08:29:58 +11:00
AP_Relay AP_Relay: check enabled relay mask for passing relay outputs to hardware 2023-09-11 12:21:13 +10:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_SBusOut AP_SBusOut: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
AP_Scheduler AP_Scheduler: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_Scripting AP_Scripting: add basic print 2023-10-04 18:34:08 +11:00
AP_SerialLED AP_SerialLED: add support for NeoPixelRGB via set_num_neopixel_rgb() 2023-10-04 18:06:17 +11:00
AP_SerialManager AP_SerialManager: only enable configuration ports that are available 2023-09-26 11:31:08 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow more libraries to compile with no HAL_GCS_ENABLED 2023-09-05 22:23:51 +10:00
AP_SmartRTL AP_SmartRTL: fix disable if second point fails to add 2023-09-19 08:01:47 +09:00
AP_Soaring
AP_Stats
AP_TECS AP_TECS: fixed descent or lack of climb bug 2023-09-28 20:37:41 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TempratureSensor: add support for analog sensor with polynomial 2023-10-04 18:28:09 +11:00
AP_Terrain AP_Terrain: fixed build for periph 2023-08-24 13:06:40 +10: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: use AP_GPS_ENABLED to exclude more code when GPS not compiled in 2023-09-27 16:38:15 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands 2023-09-13 18:05:24 +10:00
AP_VisualOdom AP_VisualOdom: visualodom requires DCM to work 2023-09-27 08:00:54 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: Support PD Max 2023-09-26 10:41:05 +10:00
AP_Winch AP_Winch: Make healthy strings common 2023-10-09 17:06:59 +09:00
AP_WindVane AP_WindVane: Change from DOS to UNIX line endings 2023-09-08 17:09:26 +10:00
AR_Motors AP_MotorsUGV: add asymmetry factor for skid-steering 2023-08-22 09:14:42 +09:00
AR_WPNav
Filter Filter: LowPassFilter2p: constrain cuttoff to 40% of sample rate 2023-10-10 08:26:05 +09:00
GCS_MAVLink GCS_MAVLink: handle EKF_SOURCE_SET as both long and int 2023-10-11 18:37:02 +11:00
PID
RC_Channel RC_Channel: added VFWD_THR_OVERRIDE 2023-09-27 11:43:45 +10:00
SITL SITL: fix typos 2023-10-05 12:54:43 +11:00
SRV_Channel SRV_Channel: correct description of SERVO_RC_FS_MSK 2023-08-15 08:16:16 +10:00
StorageManager
doc
COLCON_IGNORE