ardupilot/libraries
Peter Barker 8f1c255693 AP_Camera: stash information required for camera_feedback message
This means the data sent in the mavlink message is closer to the
information when the picture was taken, rather than when we decide we
have the space to send the mavlink message.  When we process the
deferred request to send the camera feedback message is up to the
vagaries of mavlink scheduling, so the data can become quite out-of-date
2021-11-17 18:48:00 +11:00
..
AC_AttitudeControl AC_AttitudeControl: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AC_AutoTune AC_AutoTune: set slew rate to 0 while twitching 2021-11-11 08:13:23 +09:00
AC_Autorotation AC_Autorotation: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +10:00
AC_Avoidance AC_Avoid: Convert Dijkstras to A-star 2021-11-16 15:08:16 +09:00
AC_Fence
AC_InputManager
AC_PID AC_PID: add slew_rate modifier 2021-11-11 08:13:23 +09:00
AC_PrecLand AC_PrecLand: Raise internal error if state machine is running while precland is disabled 2021-08-30 14:08:44 +09:00
AC_Sprayer AC_Sprayer: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AC_WPNav AC_WPNav: add getter for wp_radius_cm 2021-09-15 20:36:56 +10:00
APM_Control APM_Control: suppress roll/pitch D term in ground_mode 2021-10-30 18:45:53 +11:00
AP_ADC
AP_ADSB AP_ADSB: bugfix vertical velocity sign was backwards 2021-10-28 09:51:33 +11:00
AP_AHRS AP_AHRS: relax arming checks for inactive AHRS types 2021-11-04 17:44:29 +11:00
AP_AIS AP_AIS: Make the char_to_hex method a common method 2021-11-09 10:16:25 +11:00
AP_AccelCal AP_AccelCal: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_Airspeed AP_Airspeed: make MAV_SEVERITY levels higher 2021-11-03 18:06:48 -07:00
AP_Arming AP_Arming: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_BLHeli AP_BLHeli: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_Baro AP_Baro: add option to set BARO_EXT_BUS default value 2021-10-11 17:57:52 -03:00
AP_BattMonitor AP_BattMonitor: remove old parameter conversion to allow setting BATT_MONITOR to 0 2021-11-16 11:58:01 +11:00
AP_Beacon AP_Beacon: have nooploop use base-class uart instance 2021-11-02 11:19:18 +11:00
AP_BoardConfig AP_BoardConfig: allow for heater polarity setting on FMU 2021-11-10 08:47:21 +11:00
AP_Button AP_Button: update FUNx values 2021-09-21 09:36:24 +10:00
AP_CANManager AP_CANManager: fixed CAN protocol docs to include USD1 2021-10-26 15:31:12 +11:00
AP_Camera AP_Camera: stash information required for camera_feedback message 2021-11-17 18:48:00 +11:00
AP_Common AP_Common: add support for setting custom external buffer 2021-11-10 17:21:35 +11:00
AP_Compass AP_Compass: Add support to AK09915 2021-11-10 18:11:34 -03:00
AP_DAL AP_DAL: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_Declination AP_Declination: added a test suite for AP_Declination 2021-09-03 14:45:17 +10:00
AP_Devo_Telem AP_Devo_Telem: fix gpsDdToDmsFormat method 2021-11-16 11:37:10 +11:00
AP_EFI AP_EFI: Remove @RebootRequired: False 2021-08-19 10:00:16 +10:00
AP_ESC_Telem AP_ESC_Telem: fix raw rpm 2021-09-01 17:15:32 +10:00
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: reset buf_used 2021-11-11 07:44:57 +11:00
AP_Filesystem AP_Filesystem: add support for downloading raw storage via ftp sysfs 2021-11-10 17:21:35 +11:00
AP_FlashIface AP_FlashIface: add jedec test using bootloader config 2021-09-01 17:10:53 +10:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow AP_Follow: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +10:00
AP_Frsky_Telem AP_Frsky_Telem: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_GPS AP_GPS_UBLOX: tidy reading of uart data 2021-11-09 10:31:25 +11:00
AP_Generator AP_Gererator: IE Fuel Cell: reset health timer at init 2021-10-08 19:34:34 -04:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_HAL AP_HAL: Update Navigator board to R4 2021-11-10 18:11:34 -03:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: add get_storage_ptr method 2021-11-10 17:21:35 +11:00
AP_HAL_Empty AP_HAL_Empty: AnalogSource: return bool 2021-10-06 18:42:51 +11:00
AP_HAL_Linux AP_HAL_Linux: Update SPIDevice for Navigator R4 2021-11-10 18:11:34 -03:00
AP_HAL_SITL AP_HAL_SITL: quieten i2c-device-creation diagnostics 2021-11-12 10:17:28 +11:00
AP_Hott_Telem AP_Hott_Telem: cope with BARO_MAX_INSTANCES = 1 2021-09-29 10:51:14 +10:00
AP_ICEngine AP_ICEngine: spelling and grammer fixes inc in param description 2021-08-19 10:00:16 +10:00
AP_IOMCU AP_IOMCU: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_IRLock AP_IRLock_I2C: add comment on calibration equation 2021-09-13 10:56:00 +09:00
AP_InertialNav AP_InertialNav: handle renaming of AP_InertialNav_NavEKF to AP_InertialNav 2021-10-20 18:09:36 +11:00
AP_InertialSensor AP_InertialSensor: fixed comments on IMU types supported 2021-11-09 08:05:03 +11:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_LTM_Telem
AP_Landing AP_Landing: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_LandingGear
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: tidy construction of backends 2021-11-09 10:18:10 +11:00
AP_MSP AP_MSP: factor code in init method 2021-10-28 20:37:24 +11:00
AP_Math AP_Math: esp32 with esp_idf have MIN and MAX defined to something else. 2021-11-01 17:40:31 +11:00
AP_Menu
AP_Mission AP_Mission: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_Module AP_Module: fix examples for AP_AHRS_DCM becoming backend 2021-08-31 14:28:53 +10:00
AP_Motors AP_Motors: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_Mount AP_Mount: add handle_global_position_int() method to backend and use it + little spelling 2021-10-08 14:22:43 +11:00
AP_NMEA_Output AP_NMEA_Output: use vector.xy().length() instead of norm(x,y) 2021-09-14 10:43:46 +10:00
AP_NavEKF AP_NavEKF: log EKF data source set changes 2021-08-11 19:28:28 +09:00
AP_NavEKF2 AP_NavEKF2: add accessor for GSF yaw estimator 2021-11-01 09:00:27 +11:00
AP_NavEKF3 AP_NavEKF3: fixed switch to non-zero primary on disarm 2021-11-07 10:11:52 +11:00
AP_Navigation
AP_Notify AP_Notify: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OSD AP_OSD: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_OpticalFlow AP_OpticalFlow: SITL driver applies _FX/YSCALER params 2021-08-24 16:49:04 +09:00
AP_Parachute AP_Parachute: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Param AP_Param: remove unused convert_parent_class() 2021-11-02 10:18:09 +11:00
AP_PiccoloCAN
AP_Proximity AP_Proximity: make rangefinder ranges m rather than cm 2021-10-21 21:28:53 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: use data structure for serial configurations 2021-11-16 22:06:24 +11:00
AP_RCTelemetry AP_CRSF_Telem: adjusted status text frame size based on actually used bytes 2021-11-01 21:32:24 +11:00
AP_ROMFS
AP_RPM AP_RPM: Mark type = PWM as not used in docs 2021-08-25 09:36:58 +10:00
AP_RSSI AP_RSSI: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_RTC AP_RTC: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_Radio AP_Radio: hide params with enable flag 2021-08-24 09:38:46 +10:00
AP_Rally AP_Rally: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_RangeFinder AP_RangeFinder: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
AP_Scripting AP_Scripting: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: disable unused RX/TX pins on uarts 2021-11-07 07:00:35 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11:00
AP_Stats
AP_TECS AP_TECS: no longer child of SpdHgtController 2021-11-13 08:05:39 +11:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: make TERRAIN_MARGIN a float 2021-08-31 09:25:36 +10:00
AP_Torqeedo AP_Torqeedo: handle outgoing esc characters 2021-10-26 19:40:52 +09:00
AP_ToshibaCAN AP_ToshibaCAN: fixed printf format errors 2021-08-05 09:43:35 +10:00
AP_Tuning AP_Tuning: add options to prevent spamming tuning error messages 2021-09-21 07:56:19 +09:00
AP_UAVCAN AP_UAVCAN: hide -Wcast-function-type warning on GCC11 2021-11-13 17:28:30 +11:00
AP_Vehicle AP_Vehicle: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: removed empty constructors 2021-10-31 09:47:12 +11:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: quadrature spelling changed 2021-10-27 16:03:06 +11:00
AP_Winch AP_Winch: use floats for get/set output scaled 2021-10-20 18:29:58 +11:00
AP_WindVane AP_WindVane: fix ADC scaling on IOMCU 2021-11-16 14:12:43 +11:00
AR_Motors AP_MotorsUGV: make pwm_type private and add is_digital_pwm_type method 2021-10-06 18:59:57 +11:00
AR_WPNav AR_WPNav: integrate PathPlanner returning path_planner_used 2021-07-22 08:51:41 +09:00
Filter Filter: set output slew rate to zero when max is zero. 2021-11-11 08:13:23 +09:00
GCS_MAVLink GCS_MAVLink: move from ENABLE_SCRIPTING to AP_SCRIPTING_ENABLED 2021-11-15 20:27:40 +11:00
PID
RC_Channel RC_Channel: added fixed wing autotune rc option 2021-11-10 18:46:34 +11:00
SITL WEBOTS_SITL: adjust_params model 2021-11-16 13:30:12 +11:00
SRV_Channel SRV_Channel: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI 2021-10-26 11:42:12 +11:00
StorageManager StorageManager: fix storage manager counts and merge common areas 2021-11-10 19:03:59 +11:00
doc