ardupilot/libraries
Andy Piper ccb583d092 AP_Logger: make block logger conform to mavlink expectations of numbering
add support for log time to block logger
refactor rotation into backed. Don't start logs when erasing
correct log start logic
separate read and write points so that requesting log information does not corrupt the current log
when starting a new log stop logging first
clear the write buffer when starting a new log
insert utc time when requesting info for the current log
stop logging and request formats again when starting a new log
cope with erase happening while we are logging
keep pushing out startup messages even when format messages are done
don't log to the gcs in the io thread
don't start new logs in the io thread
don't validate logs while erasing
flush logs when stopping logging
account for page header when calculating logs sizes
don't return data when asked for more data than in the log
optimize locking and use separate semaphore to mediate ring buffer access
stop logging when the chip is full and send a notification
calculate logs sizes correctly even when they wrap
read log data correctly even when it wraps
add stats support to block logger
reset dropped when starting a new log
fail logging when the chip is full
refactor critical bufferspace checks
increase messagewriter budget to 250us and to 300us for FMT
2020-09-05 10:20:39 +10:00
..
AC_AttitudeControl AC_PosControl: correct VELXY_D_FILT Description 2020-06-23 11:40:12 +09:00
AC_Autorotation AC_Autorotation: add documentation for AROT message 2020-07-21 17:45:55 +10:00
AC_AutoTune AC_AutoTune: set FLTT to zero while twitching 2020-06-30 20:09:48 +10:00
AC_Avoidance AC_Avoid: Added new OA type (Dijkstra + BendyRuler fusion) 2020-08-26 15:43:46 +09:00
AC_Fence AC_Fence: remove dead and misleading assignment 2020-08-06 17:02:12 +10:00
AC_InputManager AC_InputManager: tradheli-Fix parameter metadata errors 2020-01-13 12:41:30 -05:00
AC_PID AC_PID: added AC_PI controller 2019-11-02 16:31:04 +11:00
AC_PrecLand AC_PrecLand: POS param range of 5m and 1cm increment 2020-02-01 08:46:03 +09:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_WPNav: Navigation based on type of BendyRuler 2020-08-24 08:53:20 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC
AP_ADSB AP_ADSB: add missing break statement 2020-01-15 13:55:42 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: Change the unit of barometric pressure from mbar to hPa. 2020-07-21 09:56:21 +10:00
AP_AHRS AP_AHRS: removed duplicate implementation of airspeed_estimate() 2020-08-27 20:20:51 +10:00
AP_Airspeed AP_Airspeed: added get_num_sensors() 2020-08-27 20:20:51 +10:00
AP_Arming AP_Arming: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_Avoidance AP_Avoidance: use an enumeration for the AP_Avoidance recovery action 2020-08-19 11:38:19 +10:00
AP_Baro AP_Baro: able to freeze baro using SITL parameter 2020-08-27 20:20:51 +10:00
AP_BattMonitor AP_BattMonitor: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_Beacon AP_Beacon: fix sitl position to be NED 2020-08-25 09:38:10 +09:00
AP_BLHeli AP_BLHeli: added have_telem_data() API 2020-09-02 05:56:46 +10:00
AP_BoardConfig AP_BoardConfig: remove CAN management from BoardConfig 2020-08-19 17:31:09 +10:00
AP_Button AP_Button: add crude debouncing and get_button_state function 2020-03-19 14:59:34 -07:00
AP_Camera AP_Camera: make solo gimbal inclusion configurable per-board 2020-08-04 09:18:14 +10:00
AP_CANManager AP_CANManager: fix comms between SLCAN and second CAN Iface 2020-09-03 11:01:26 +10:00
AP_Common AP_Common: added missing bit set/clear functions 2020-09-02 05:56:46 +10:00
AP_Compass AP_Compass: set only if changed to save space in param storage 2020-09-02 17:06:05 +10:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem
AP_EFI AP_EFI: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ESC_Telem AP_ESC_Telem: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_Filesystem AP_Filesystem: publish can info over FS Sys iface 2020-08-19 17:31:09 +10:00
AP_FlashStorage AP_FlashStorage: fixed alignment errors 2020-07-10 13:31:27 +10:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: fix frsky serial 10 parameters 2020-07-20 20:36:34 +10:00
AP_Generator AP_Generator: update prearm checks, fill new GENERATOR_STATUS fields 2020-08-05 16:26:19 +09:00
AP_GPS AP_GPS: build SBF driver with double precision 2020-09-03 09:56:29 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: slew FFT frequency output 2020-08-05 17:20:03 +10:00
AP_HAL AP_HAL: Don't redefine allowing double math in SITL/Linux if already defined 2020-09-03 09:56:29 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: fix sdcard param init 2020-09-04 07:13:12 +10:00
AP_HAL_Empty AP_HAL_Empty: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_HAL_Linux AP_HAL_Linux: Use pthread_self in place of _ctx 2020-08-25 07:15:00 -07:00
AP_HAL_SITL AP_HAL_SITL: add GPS Velocity Error through a SITL parameter 2020-08-27 20:20:51 +10:00
AP_Hott_Telem AP_Hott_Telem: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ICEngine AP_ICEngine: convert to new get_rpm() API 2020-03-12 08:36:40 +11:00
AP_InertialNav AP_InertialNav: use ekf::get_vert_pos_rate during high vibration 2019-10-18 11:15:25 +09:00
AP_InertialSensor AP_InertialSensor: trigger internal error on persistent IMU reset 2020-09-02 06:42:44 +10:00
AP_InternalError AP_InternalError: added imu_reset error 2020-09-02 06:42:44 +10:00
AP_IOMCU AP_IOMCU: fixed handling of RC ignore failsafe option 2020-08-25 09:53:26 +10:00
AP_IRLock AP_IRLock: Change the tab code to whitespace 2020-04-27 09:29:11 +09:00
AP_JSButton
AP_KDECAN AP_KDECAN: remove KDECAN example KDECAN test is moved to CANTester 2020-08-20 07:44:53 +10:00
AP_L1_Control AP_L1_Control: wrap_180_cd no longer solely returns floats 2019-09-18 12:57:02 +10:00
AP_Landing AP_Landing: implement continue after land for fixed wing landings 2020-06-02 09:12:22 +09:00
AP_LandingGear AP_LandingGear: Change the tab code to whitespace 2020-04-27 09:29:18 +09:00
AP_LeakDetector
AP_Logger AP_Logger: make block logger conform to mavlink expectations of numbering 2020-09-05 10:20:39 +10:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: added CRCs needed by AP_MSP 2020-09-02 05:56:46 +10:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: add CMD_DO_WINCH string 2020-08-07 21:55:07 +09:00
AP_Module
AP_Motors AP_Motors: minor whitespace fix 2020-08-10 09:33:43 +09:00
AP_Mount AP_Mount: make mount/gimbal inclusion configurable per-board and disable Solo gimbal on all 1MB boards 2020-08-04 09:18:14 +10:00
AP_MSP AP_MSP: fixed system ID 2020-09-02 05:56:46 +10:00
AP_NavEKF AP_NavEKF: Enable external setting of yaw estimator bias states 2020-07-07 15:33:58 +10:00
AP_NavEKF2 AP_NavEKF2: fixed segfault when IMU mask covers more IMUs than GSF mask 2020-08-28 10:17:00 +10:00
AP_NavEKF3 AP_NavEKF3: fixed segfault when IMU mask covers more IMUs than GSF mask 2020-08-28 10:17:00 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Notify AP_Notify: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_OpticalFlow AP_OpticalFlow: allow separate enable of MSP opticalflow 2020-09-02 05:56:46 +10:00
AP_OSD AP_OSD: prevent startup segfault 2020-09-02 05:56:46 +10:00
AP_Parachute AP_Parachute: Fix singleton panic message 2020-05-05 07:43:02 +10:00
AP_Param AP_Param: add set_and_save_ifchanged for Vector3f params 2020-09-02 17:06:05 +10:00
AP_PiccoloCAN AP_PiccoloCAN: modify to use uavcan agnostic CAN drivers and manager 2020-08-19 17:31:09 +10:00
AP_Proximity AP_Proximity: resolve ambiguity about which distance is in which sector 2020-08-17 11:20:12 +10:00
AP_Radio AP_Radio: correct for recent semaphore bool/void changes 2020-03-03 21:56:33 +09:00
AP_Rally AP_Rally: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_RAMTRON AP_RAMTRON: fixed build with gcc 9.x 2020-04-01 17:08:48 +11:00
AP_RangeFinder AP_Rangefinder: Add SITL option in param description 2020-09-02 17:25:43 +10:00
AP_RCMapper AP_RCMapper: add singleton 2019-12-30 13:02:04 +11:00
AP_RCProtocol AP_RCProtocol: put back DSM VTX control and logging, add tests 2020-09-02 17:10:59 +10:00
AP_RCTelemetry AP_RCTelemetry: move CRSF link statistics definition to AP_RCProtocol 2020-08-06 18:24:46 +10:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: added directory listing interface 2020-03-28 15:28:03 +11:00
AP_RPM AP_RPM: allow harmonic notch driver to appear as RPM values. 2020-04-14 09:43:16 +10:00
AP_RSSI AP_RSSI: add RADIO_STATUS.rssi as an AP_RSSI telemetry source 2020-06-09 10:20:29 +10:00
AP_RTC AP_RTC: use GCS_SEND_TEXT() 2020-04-29 07:36:55 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: allow registration of tasks at loop rate 2020-02-22 11:15:37 +11:00
AP_Scripting AP_Scripting: quadruped.lau fix after review 2020-09-01 09:33:24 +09:00
AP_SerialLED AP_SerialLED: support ProfiLEDs 2020-03-10 10:37:26 +11:00
AP_SerialManager AP_SerialManager: added support for the MSP protocol 2020-09-02 05:56:46 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: do-set-servo affects sprayer and gripper 2020-02-11 11:08:02 +11:00
AP_SmartRTL AP_SmartRTL: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Soaring AP_Soaring: Allow continued thermalling in manual mode changes RC switch position. 2020-08-19 13:38:56 +10:00
AP_SpdHgtControl AP_TECS: Add flags to indicate gliding flight, and use these with AP_Soaring. 2020-04-08 09:11:54 +10:00
AP_Stats AP_Stats: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_TECS AP_TECS: Don't fetch the land slewrate if it's not needed 2020-07-31 10:30:17 -07:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: fix TSYS01 warning on SITL 2020-02-05 17:10:58 -05:00
AP_Terrain AP_Terrain: fix snprintf-overflow compilation error 2020-08-07 12:36:12 +10:00
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 2020-08-19 17:31:09 +10:00
AP_Tuning AP_Tuning: add documentation for PRTN message 2020-04-14 07:34:59 +10:00
AP_UAVCAN AP_UAVCAN: fix UAVCAN sniffer example 2020-08-20 07:44:53 +10:00
AP_Vehicle AP_Vehicle: added support for the MSP protocol 2020-09-02 05:56:46 +10:00
AP_VisualOdom AP_VisualOdom: Shorten the distinguished name. 2020-07-28 09:09:27 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: Change the tab code to whitespace 2020-04-27 09:32:15 +09:00
AP_Winch AP_Winch: fix type parameter description 2020-08-07 21:55:07 +09:00
AP_WindVane AP_WindVane_NMEA: decode each sentence once 2020-07-29 17:40:03 +10:00
APM_Control APM_Control: Add gyro feedback limit cycle protection 2020-07-13 13:47:50 +10:00
AR_WPNav AR_WPNav: minor param description typo fix 2020-08-07 08:30:03 +09:00
doc
Filter Filter: return active harmonics based on dynamic harmonic enablement 2020-07-14 09:50:06 +10:00
GCS_MAVLink GCS_Common: send_local_position uses offset from origin 2020-09-01 10:27:18 +10:00
PID
RC_Channel Plane: Add use of airbrakes, used when throttle is negative OR via RC channel option. 2020-09-02 10:10:09 -07:00
SITL SITL: Disabling debugging cyclic messages 2020-09-03 11:31:05 +10:00
SRV_Channel Plane: Add use of airbrakes, used when throttle is negative OR via RC channel option. 2020-09-02 10:10:09 -07:00
StorageManager StorageManager: use pragmas to set storage layout rather than call 2020-01-28 11:34:51 +11:00