ardupilot/libraries
Andrew Tridgell 7c47049076 AP_Param: don't enable param backup on all boards
this fixes an issue with resetting of parameters when going between
4.4.x and 4.5.x on MatekH743, and on any other board using flash
storage where the storage size has increased from 16k to 32k between
4.4.x and 4.5.x

The problem is that when you update to 4.5.x the parameter code stored
a backup of parameters in the StorageParamBak storage region which is
in the last section of storage. When you downgrade to 4.4.x the
AP_FlashStorage::load_sector() code tries to load this data and gets
an error as it is beyond the end of the available 16k storage. This
triggers an erase_all() and loss of parameters
2024-01-28 08:43:57 +11:00
..
AC_AttitudeControl AC_AttitudeControl: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_Avoidance AC_Avoidance: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AC_CustomControl AP_CustomControl: use base class AC_AttitudeControl object 2023-12-05 08:08:09 +09:00
AC_Fence AC_Fence: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_InputManager
AC_PID AC_PID: add reset and I term set flags to PIDInfo 2024-01-03 12:28:59 +09:00
AC_PrecLand AC_PrecLand: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_Sprayer AC_Sprayer: Fix some typos 2023-10-12 18:30:42 +11:00
AC_WPNav AC_WPNav: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
APM_Control APM_Control: change LIM_ROLL_CD to ROLL_LIMIT_DEG 2024-01-23 15:00:30 +11:00
AP_ADC
AP_ADSB AP_ADSB: send absolute height in GPS packet to MXS device 2024-01-16 13:41:22 +11:00
AP_AHRS AP_AHRS: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AP_AIS AP_AIS: correct compilation when HAL_LOGGING_ENABLED is false 2024-01-17 18:25:55 +11:00
AP_AccelCal AP_AccelCal: remove pointless assignment when counting calibrators 2024-01-21 09:53:04 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_Airspeed AP_Airspeed: convert ARSPD_FBW_MIN/MAX to AIRSPEED_MIN and AIRSPEED_MAX 2024-01-23 15:00:30 +11:00
AP_Arming AP_Arming: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Avoidance AP_Avoidance: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_BLHeli AP_BLHeli: allow bdshot iomcu on non-bdshot fmu 2023-12-18 19:02:52 +11:00
AP_Baro Updated identification code per the datasheet 2024-01-23 11:08:33 +11:00
AP_BattMonitor AP_BattMonitor: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Beacon AP_Beacon: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_BoardConfig AP_BoardConfig: added detection of Holybro6X-45686 2024-01-23 11:49:14 +11: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: reimplement with BinarySemaphore 2024-01-03 07:37:05 +11:00
AP_CSVReader
AP_Camera AP_Camera: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_CheckFirmware AP_CheckFirmware: rename sim_periph_gps to sim_gps_universal, recreate sim_periph_gps 2024-01-16 12:16:35 +11:00
AP_Common AP_Common: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_Compass AP_Compass: rename COMPASS_TYPEMASK to COMPASS_DISBLMSK 2024-01-23 11:54:49 +11:00
AP_CustomRotations
AP_DAL AP_DAL: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_DDS AP_DDS: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_EFI AP_EFI: add missing include 2024-01-11 15:29:54 +11:00
AP_ESC_Telem AP_ESC_Telem: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_ExternalAHRS AP_ExternalAHRS: Reserve aaeron ID 2024-01-21 07:33:17 +11:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: remove references to legacy UART order 2023-12-19 06:53:15 +11:00
AP_Filesystem AP_Filesystem: allow for large file IOs 2024-01-05 06:52:11 -08:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Follow AP_Follow: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Frsky_Telem AP_FrskyTelem: fixed warning on ESP32 2024-01-07 20:51:55 +11:00
AP_GPS AP_GPS: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AP_Generator AP_Generator: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_Gripper AP_Gripper: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_GyroFFT AP_GyroFFT: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_HAL AP_HAL_SITL: new Loweheiser generator/efi sim 2024-01-23 11:27:30 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: enable clock management on G4 2024-01-25 11:44:52 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: analog warning fix 2024-01-09 11:15:21 +11:00
AP_HAL_Empty AP_HAL_Empty: eliminate legacy UART ordering/references 2023-12-19 06:53:15 +11:00
AP_HAL_Linux HAL_Linux: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_HAL_SITL AP_HAL_SITL: correct ubsan compilation 2024-01-23 11:30:23 +11:00
AP_Hott_Telem AP_Hott_Telem: allow for compilation without AP_RTC_ENABLED 2023-10-11 19:17:27 +11:00
AP_ICEngine AP_ICEngine: add support for starter relay 2023-12-20 19:29:50 +11:00
AP_IOMCU AP_IOMCU: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11: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: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_LTM_Telem AP_LTM_Telem: correct compilation when AP_AHRS_ENABLED is off 2024-01-16 16:14:04 +11:00
AP_Landing AP_Landing: convert LAND_PITCH_CD to LAND_PITCH_DEG 2024-01-23 15:00:30 +11:00
AP_LandingGear AP_LandingGear: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_LeakDetector
AP_Logger AP_Logger: make it clear that bodyX and bodyY are rotational rates 2024-01-22 19:14:42 +11:00
AP_MSP AP_MSP: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_Math AP_Math: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Menu
AP_Mission AP_Mission: fix use of uninitialised stack data 2024-01-24 09:04:28 +11:00
AP_Module AP_Module: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Motors AP_Motors: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Mount AP_Mount: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_NMEA_Output AP_NMEA_Output: fixed NMEA output altitude 2024-01-02 20:59:50 +11:00
AP_NavEKF AP_NavEKF: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_NavEKF2 AP_NavEKF2: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AP_NavEKF3 AP_NavEKF3: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AP_Navigation
AP_Networking AP_Networking: allow hwdef.dat to override more options 2024-01-21 12:30:08 +11:00
AP_Notify AP_Notify: ensure dshot LEDs work with EDT ESCs 2023-12-18 19:02:52 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF
AP_OSD AP_OSD: convert ALT_HOLD_RTL to RTL_ALTITUDE 2024-01-23 15:00:30 +11:00
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: correct comments on AP_OpticalFlow methods 2024-01-22 19:14:42 +11:00
AP_Parachute AP_Parachute: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Param AP_Param: don't enable param backup on all boards 2024-01-28 08:43:57 +11:00
AP_PiccoloCAN AP_PiccoloCAN: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Proximity AP_Proximity: move simulated height_agl into fdm structure 2024-01-08 20:00:01 +11:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: add is_detected() so that telemetry implementations can defer actions 2024-01-17 18:31:15 +11:00
AP_RCTelemetry AP_RCTelemetry: check that CRSF and GHST have been detected before sending a version ping or doing rf changes 2024-01-17 18:31:15 +11:00
AP_ROMFS
AP_RPM AP_RPM: include backend header 2023-08-22 09:09:54 +10:00
AP_RSSI AP_RSSI: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_RTC AP_RTC: remove pointless assignment of total_delay_ms 2024-01-21 09:53:04 +11:00
AP_Radio
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RangeFinder AP_RangeFinder: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Relay AP_Relay: send relay status for all relays with valid functions 2024-01-23 10:42:02 +11:00
AP_RobotisServo libraries: fix delay after subsequent Robotis servo detections 2023-08-04 08:55:55 +10:00
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Scripting AP_Scripting: fixed parameter names 2024-01-23 15:00:30 +11:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: added PPP serial type 2024-01-03 12:14:47 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
AP_SmartRTL AP_SmartRTL: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Soaring AP_Soaring: convert remaining uses of TRIM_ARSPD_CM to AIRSPEED_CRUISE 2024-01-23 15:00:30 +11:00
AP_Stats AP_Stats: initialise parameter defaults 2023-11-22 21:43:00 -08:00
AP_TECS AP_TECS: fixed param names in comments 2024-01-23 15:00:30 +11:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
AP_TemperatureSensor AP_TemperatureSensor: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Terrain AP_Terrain: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Torqeedo AP_Torqeedo: Updates to log message units and help text 2024-01-21 14:26:54 +11:00
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: tidy TRIM_PITCH to PTCH_TRIM_DEG 2024-01-23 15:00:30 +11:00
AP_VideoTX AP_VideoTX: Restore use of the VTX_MAX_POWER parameter 2024-01-02 12:00:22 +11:00
AP_VisualOdom AP_VisualOdom: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Winch AP_Winch: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_WindVane AP_WindVane: correct compilation when HAL_LOGGING_ENABLED is false 2024-01-17 18:25:55 +11:00
AR_Motors AP_MotorsUGV: Fix Riscv64 compiler error issue #25974 2024-01-23 08:34:33 +09:00
AR_WPNav AR_WPNav: send next destination to OA 2023-12-28 08:45:23 +09:00
Filter Filter: fixed uint8_t bug in total filters and expand_filter_count bug 2023-11-28 18:05:37 +11:00
GCS_MAVLink GCS_MAVLink: use virtual method for GCS_MAVLink::handle_message 2024-01-24 09:07:41 +11:00
PID
RC_Channel RC_Channel: tidy a comment for LAND_PITCH_DEG 2024-01-23 15:00:30 +11:00
SITL SITL: fixed name of pitch limit parameters 2024-01-23 15:00:30 +11:00
SRV_Channel SRV_Channel: fix scaled passthrough of ranges 2023-11-15 18:20:45 +11:00
StorageManager
doc
COLCON_IGNORE