Ardupilot2/libraries
Andrew Tridgell 93b55e367e AP_Logger: fixed log listing with gap, and EKF error on log list
this fixes two issues:

The first issue that if we are missing a log file in the middle of the
list then it was not possible to download recent logs, as we get the
incorrect value for total number of logs. This happened for me with
107 logs, with log62 missing from the microSD. It would only show 45
available logs, so the most recent logs could not be downloaded.

The second issue is that get_num_logs() was very slow if there were a
lot of log files in a directory. This would cause EKF errors and ESC
resets. Using a opendir/readdir loop is much faster (approx 10x faster
in my testing with 107 logs on a MatekH743).
2022-04-19 11:45:26 +10:00
..
AC_AttitudeControl AC_PosControl_Sub.h: do not use our own input_vel_accel_z 2022-04-13 16:23:55 -03:00
AC_Autorotation AC_Autorotation: use accel_to_angle() 2022-03-18 13:36:16 +11:00
AC_AutoTune AC_AutoTune: fix gain determination fail logic 2022-04-18 18:00:20 +09:00
AC_Avoidance AC_Avoid: enable slide behaviour for rover 2022-03-30 15:34:14 +09:00
AC_Fence AC_Fence: include cleanups 2022-03-01 11:21:33 +11:00
AC_InputManager AC_InputManager: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AC_PID AC_PID: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AC_PrecLand AC_PrecLand: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10: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: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_AccelCal AP_AccelCal: remove unused calc_mean_squared_residuals 2022-01-26 12:03:17 +09:00
AP_ADC
AP_ADSB AP_ADSB: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_AHRS AP_AHRS_DCM: NFC comment on check_matrix() normalization reset 2022-04-19 09:27:00 +10:00
AP_Airspeed AP_Airspeed: correct metadata for params for non-Plane vehicles 2022-04-05 09:58:10 +10:00
AP_AIS AP_AIS: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Arming AP_Arming: use HarmonicNotch class 2022-04-19 09:39:03 +10:00
AP_Avoidance AP_Avoidance: tidy construction of vector on stack 2022-02-01 19:40:22 +11:00
AP_Baro AP_Baro: correct param description refering to EK3 wind est params 2022-04-13 07:57:35 +09:00
AP_BattMonitor AP_BattMonitor: fixed battery remaining of sum battery 2022-03-23 20:21:38 +11:00
AP_Beacon AP_Beacon: move logging of Beacon into Beacon library 2022-04-13 16:22:19 +10:00
AP_BLHeli AP_BLHeli: add reboot required to some parameters 2022-03-24 11:20:09 +09:00
AP_BoardConfig AP_BoardConfig: add WHOAMI for INV42688 2022-03-20 07:23:10 -07:00
AP_Button AP_Button: include cleanups 2022-03-01 11:21:33 +11:00
AP_Camera AP_Camera: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_CANManager AP_CANManager: correct parameter metadata error 2022-03-14 08:18:13 +11:00
AP_Common AP_Common: improved accuracy of get_bearing() 2022-03-10 07:34:20 +11:00
AP_Compass AP_Compass: split AP_HAL_SITL and AP_SIM_ENABLED 2022-03-17 14:39:55 +11:00
AP_CustomRotations add AP_CustomRotations 2022-03-02 18:16:42 +11:00
AP_DAL AP_DAL: prevent logical loop between AHRS and EKF 2022-02-07 14:13:49 +11:00
AP_Declination AP_Declination: ensure indexing into declination tables is always correct 2022-03-15 10:15:22 +11:00
AP_Devo_Telem AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_EFI AP_EFI: include cleanups 2022-03-01 11:21:33 +11:00
AP_ESC_Telem AP_ESC_Telem: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_ExternalAHRS AP_ExternalAHRS: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_FETtecOneWire AP_FETtecOneWire: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_Filesystem AP_Filesystem: AP_Filesystem_ESP32 allow_absolute_paths in ::open() 2022-04-05 08:40:26 +10:00
AP_FlashIface AP_FlashIface: make sure XIP flash is ready before returning 2022-04-12 09:19:45 +10:00
AP_FlashStorage AP_FlashStorage: support L496 MCUs 2021-09-24 18:08:00 +10:00
AP_Follow AP_Follow: added APIs for plane ship landing 2022-03-10 07:34:20 +11:00
AP_Frsky_Telem AP_Frsky_Telem: nuke clang warnings 2022-03-03 16:34:14 +11:00
AP_Generator AP_Generator: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_GPS AP_GPS: stop using HAL_BUILD_AP_PERIPH to gate GPS backends 2022-04-13 18:23:51 +10:00
AP_Gripper AP_Gripper: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_GyroFFT AP_GyroFFT: added defaults for FFT with no notch 2022-04-19 09:39:03 +10:00
AP_HAL AP_HAL: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add support for NucleoH755 board 2022-04-18 14:53:14 +10:00
AP_HAL_Empty AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering 2022-01-12 18:30:49 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: partitions.csv - increase app partition to 3M 2022-04-05 08:41:11 +10:00
AP_HAL_Linux AP_HAL:RPI read cpu by revision 2022-03-24 00:51:27 -07:00
AP_HAL_SITL AP_HAL_SITL: correct disable channel maths 2022-03-29 10:29:31 +11:00
AP_Hott_Telem AP_Hott_Telem: add define AP_AIRSPEED_ENABLED 2022-01-19 18:21:32 +11:00
AP_ICEngine AP_ICEngine: include cleanups 2022-03-01 11:21:33 +11:00
AP_InertialNav AP_InertialNav: nfc, fix to say relative to EKF origin 2022-02-03 12:05:12 +09:00
AP_InertialSensor AP_InertialSensor: call notch param update with semaphore held 2022-04-19 09:39:03 +10:00
AP_InternalError AP_InternalError: change panic to return error code as string in SITL 2021-09-28 09:11:48 +10:00
AP_IOMCU AP_IOMCU: fixed handling of RC_OPTIONS bit to ignore RC failsafe bit 2022-03-22 10:30:35 +11:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: update_waypoint wrap added to nav_bearing 2022-02-16 18:29:48 +11:00
AP_Landing AP_Landing: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_LandingGear AP_LandingGear: add enable param 2021-11-23 11:40:44 +11:00
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: fixed log listing with gap, and EKF error on log list 2022-04-19 11:45:26 +10:00
AP_LTM_Telem AP_LTM_Telem: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Math AP_Math: added unsigned versions of constrain functions 2022-04-05 17:46:52 +10:00
AP_Menu
AP_Mission AP_Mission: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_Module AP_Module: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_Motors AP_Motors: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Mount AP_Mount: enable Solo Gimbal only on CubeGreen 2022-03-29 08:24:59 +09:00
AP_MSP AP_MSP: include cleanups 2022-03-01 11:21:33 +11:00
AP_NavEKF AP_NavEKF: GSF logging in deg from 0 to 360 2022-04-19 08:56:40 +10:00
AP_NavEKF2 AP_NavEKF2: remove instance id from EK2 external interface 2022-04-12 10:25:29 +10:00
AP_NavEKF3 AP_NavEKF3: correct wind estimate param descriptions 2022-04-13 07:57:35 +09:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: use a fixed maximum number of NMEA outputs 2022-02-23 12:36:59 +11:00
AP_Notify AP_Notify: fixed DroneCAN LEDs on AP_Periph 2022-03-09 07:51:35 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OpticalFlow AP_OpticalFlow: Change division to multiplication 2022-02-01 17:34:40 +11:00
AP_OSD AP_OSD: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: fixed param class conversion code 2022-03-29 10:41:33 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Proximity AP_Proximity: move logging of Proximity into Proximity library 2022-04-13 16:22:19 +10:00
AP_Radio AP_Radio: include cleanups 2022-03-01 11:21:33 +11: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_RAMTRON
AP_RangeFinder AP_RangeFinder: add build option for Rangefinders 2022-03-08 14:33:38 -08:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: added using_uart() method 2022-03-28 17:09:26 +11:00
AP_RCTelemetry AP_RCTelemetry: check EKF checks against failsafe defaults. 2022-04-12 11:14:44 +10:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo AP_RobotisServo: allow RobotisServo protocol to be compiled out 2022-04-12 10:35:01 +10:00
AP_ROMFS
AP_RPM AP_RPM: use HarmonicNotch class 2022-04-19 09:39:03 +10:00
AP_RSSI AP_RSSI: convert floating point divides into multiplys 2022-03-18 15:26:44 +11:00
AP_RTC AP_RTC: fix oldest_acceptable_date to be in micros 2022-02-10 09:22:30 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: update simulation state on embedded 2022-03-17 14:39:55 +11:00
AP_Scripting AP_Scripting: correct script restart send_text message 2022-04-18 12:50:18 +01:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: Add support for High Latency MAVLink protocol 2022-03-03 14:56:15 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring AP_Soaring: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Stats
AP_TECS AP_TECS: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: added logging of terrain correction 2022-03-28 16:01:21 +11:00
AP_Torqeedo AP_Torqeedo: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_ToshibaCAN AP_ToshibaCAN: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_Tuning AP_Tuning: removed controller error messages 2022-02-22 12:23:48 +11:00
AP_UAVCAN AP_UAVCAN: correct array inxexing 2022-03-20 07:32:33 -07:00
AP_Vehicle AP_Vehicle: implement common harmonic notch update code 2022-04-19 09:39:03 +10:00
AP_VideoTX AP_VideoTX: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_VisualOdom AP_VisualOdom: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Volz_Protocol AP_Volz_Protocol: allow Volz protocol to be compiled out 2022-04-12 10:35:01 +10:00
AP_WheelEncoder AP_WheelEncoder: Change from division to multiplication 2022-03-16 18:41:52 +11:00
AP_Winch AP_Winch: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_WindVane AP_WindVane: include cleanups 2022-03-01 11:21:33 +11:00
APM_Control APM_Control: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AR_Motors AR_Motors: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AR_WPNav AR_WPNav: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
doc
Filter Filter: removed parameters from the old notch filter 2022-04-19 09:39:03 +10:00
GCS_MAVLink GCS_MAVLink: prevent devop larger than buffer 2022-04-16 19:24:16 +10:00
PID PID: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
RC_Channel RC_Channel: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
SITL SITL: add SIM_SONAR_ROT, use it for measuring horizontal distances 2022-04-19 10:26:10 +10:00
SRV_Channel SRV_Channels: stop gating FETTECONEWIRE parameters on HAL_BUILD_BUILD_AP_PERIPH 2022-04-12 10:35:01 +10:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00