ardupilot/libraries
Andrew Tridgell 1236474cfb HAL_ChibiOS: give an error if STORAGE_FLASH_PAGE overflash flash
when storage is between the bootloader and main program flash then the
flash size available to the bootloader needs to stop at the sector for
the storage flash.

Similarly, if storage is at the end of flash, then total flash size
needs to be limit

this ensures we don't try to build a firmware that encroaches on
program space
2022-01-11 11:33:30 +11:00
..
AC_AttitudeControl AC_AttitudeControl: AC_PosControl: Clean up init functions and limit initial xy accelerations based on max lean angle 2022-01-11 11:00:41 +11:00
AC_Autorotation AC_Autorotation: mark logger Write() calls as streaming where appropriate 2021-08-18 10:20:03 +10:00
AC_AutoTune AC_AutoTune: Move rate limit to AC_AttitudeControl 2022-01-11 10:57:53 +11:00
AC_Avoidance AC_Avoidance: don't build avoidance on plane 2022-01-11 09:51:47 +11:00
AC_Fence AC_Fence: void index when overwriting fence count on fencepoint-close 2021-11-30 20:50:32 +11:00
AC_InputManager
AC_PID AC_PID_2D: minor format fix 2022-01-07 13:41:16 +09:00
AC_PrecLand AC_PrecLand: Fix multi #include's 2021-12-21 10:38:46 +11: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: don't link AC_Avoid on plane 2022-01-11 09:51:47 +11:00
AP_AccelCal AP_AccelCal: move from HAL_NO_GCS to HAL_GCS_ENABLED 2021-09-22 21:37:00 +10:00
AP_ADC
AP_ADSB AP_ADSB: use have_serial when detecting 2021-12-21 11:07:44 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe 2021-08-03 10:35:24 +10:00
AP_AHRS AP_AHRS: add video stab log message 2022-01-05 19:56:03 +11:00
AP_Airspeed AP_Airspeed: change UAVCAN in metadata to DroneCAN 2021-12-15 09:53:21 +11:00
AP_AIS AP_AIS: correct number of bytes to read from device 2021-12-20 18:39:01 +09:00
AP_Arming AP_Arming: fix comment (NFC) 2022-01-06 09:15:54 +11:00
AP_Avoidance AC_Avoidance: Add APM_BUILD_Heli 2021-09-29 19:55:48 +10:00
AP_Baro AP_Baro: KellerLD: clean up reading of calibration data 2021-12-22 18:50:58 +11:00
AP_BattMonitor AP_BattMonitor: fixed a segv with BATT_MONITOR=14 2021-12-29 10:51:35 +11:00
AP_Beacon AP_Beacon: have nooploop use base-class uart instance 2021-11-02 11:19:18 +11:00
AP_BLHeli AP_BLHeli: allow for no uart in update() 2021-12-10 08:11:24 -08:00
AP_BoardConfig AP_BoardConfig: disable STLink debug pins by default 2021-12-28 10:31:25 +11:00
AP_Button AP_Button: use CopyValuesFrom to avoid duplication 2021-12-15 09:54:06 +11:00
AP_Camera AP_Camera: don't use stale image number in CAMERA_FEEDBACK 2021-11-17 18:48:00 +11:00
AP_CANManager AP_CANManager: remove MPPT_PacketDigital parameter description 2021-12-17 20:24:25 +09:00
AP_Common AP_Common: correct UINT32_VALUE 2021-12-10 08:07:43 -08:00
AP_Compass AP_Compass: added register checking for AK09916 mode 2021-12-28 16:04:36 +11:00
AP_DAL AP_DAL: create and use AP_OPTICALFLOW_ENABLED 2021-12-29 18:12:03 +11:00
AP_Declination AP_Declination: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_Devo_Telem AP_Devo_Telem: compile out devo telemetry 2021-12-01 19:16:44 +11:00
AP_EFI AP_EFI: Remove @RebootRequired: False 2021-08-19 10:00:16 +10:00
AP_ESC_Telem AP_ESC_Telem: allow build with AP_Periph 2021-12-10 08:11:24 -08:00
AP_ExternalAHRS AP_ExternalAHRS: factor substring from allocation_error parameter 2021-10-18 12:49:44 +11:00
AP_FETtecOneWire AP_FETtecOneWire: Fix spelling in comments (NFC) 2022-01-06 09:15:54 +11:00
AP_Filesystem AP_Filesystem: support formatting of SDcard on ChibiOS 2021-12-28 16:04:57 +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: use set_and_save_by_name directly 2022-01-04 11:26:29 +11:00
AP_Generator AP_Gererator: IE Fuel Cell: reset health timer at init 2021-10-08 19:34:34 -04:00
AP_GPS AP_GPS: use KSXT for position and alt when available 2022-01-11 10:34:11 +11:00
AP_Gripper AP_Gripper: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_GyroFFT AP_GyroFFT: make vehicles write notch log messages 2022-01-05 16:34:36 +11:00
AP_HAL AP_HAL_Linux: set internal/external i2c bus masks for Navigator 2022-01-06 14:45:42 -05:00
AP_HAL_ChibiOS HAL_ChibiOS: give an error if STORAGE_FLASH_PAGE overflash flash 2022-01-11 11:33:30 +11:00
AP_HAL_Empty AP_HAL_Empty: remove redundant harmonics from DSP 2021-12-22 18:13:38 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_HAL_Linux AP_HAL_Linux: RPI-CM4 detection 2022-01-10 12:21:09 -08:00
AP_HAL_SITL AP_HAL_SITL: add dataflash to spi device table 2021-12-25 09:14:31 +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_InertialNav AP_InertialNav: rename for neu & cm/cms 2021-11-30 10:08:07 +11:00
AP_InertialSensor AP_InertialSensor: mark FTN as a streamed message 2022-01-05 16:34:36 +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_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_JSButton
AP_KDECAN AP_KDECAN: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-24 09:02:42 +10:00
AP_L1_Control AP_L1_Control: Simplify the decision process by initializing the stack variables 2021-12-11 12:27:40 -08:00
AP_Landing AP_Landing: remove SpdHgt and use TECS direct 2021-11-13 08:05:39 +11: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: support Winbond W25X32 for KakuteH7Mini 2022-01-11 10:58:55 +11:00
AP_LTM_Telem AP_LTM_Telem: get airspeed sensor from singleton not AHRS object 2020-12-07 15:57:28 -08:00
AP_Math AP_Math: allow selection of inline version of vector operations for performance. 2021-12-22 18:23:33 +11:00
AP_Menu
AP_Mission AP_Mission: add ChangeDetector 2022-01-10 08:19:16 +09: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: tailsitter: add external min throttle limit 2022-01-11 10:37:38 +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_MSP AP_OSD: fix code causing errors when OSD is compiled out 2021-12-21 10:06:01 +11:00
AP_NavEKF AP_NavEKF: log EKF data source set changes 2021-08-11 19:28:28 +09:00
AP_NavEKF2 AP_NavEKF2: don't include log structures if not enabled 2022-01-05 19:39:06 +11:00
AP_NavEKF3 AP_NavEKF3: fixed gaps in EKF logging 2021-12-28 16:03:47 +11:00
AP_Navigation AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class 2021-06-11 04:59:06 -07:00
AP_NMEA_Output AP_NMEA_Output: remove pointless use of intermediate res variables 2021-12-23 21:04:18 +11:00
AP_Notify AP_Notify: change UAVCAN to DroneCAN in param metadata 2021-12-15 09:53:21 +11:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_ONVIF AP_ONVIF: use correct #pragma GCC diagnostic pop 2021-09-29 17:27:29 +10:00
AP_OpticalFlow AP_OpticalFlow: fix example when OpticalFlow compiled out 2022-01-06 13:35:51 +11:00
AP_OSD AP_OSD: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: fix convert_class when index is 0 2022-01-10 19:31:45 +00:00
AP_PiccoloCAN AP_PiccoloCAN: Bug fix for ESC temperature data 2021-12-19 10:50:37 +11:00
AP_Proximity AP_Proximity: Removed AP_Proximity_LightWareSF40C_v09 2022-01-07 08:28:59 +09: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_RAMTRON
AP_RangeFinder AP_RangeFinder: use have_serial when detecting 2021-12-21 11:07:44 +11:00
AP_RCMapper fix metadata to emit RCMAP_FORWARD and _LATERAL for Rover 2021-05-17 13:38:17 +10:00
AP_RCProtocol AP_RC_Protocol: added ExpressLRS support 2021-12-22 18:48:49 +11:00
AP_RCTelemetry AP_RCTelemetry: added ExpressLRS support 2021-12-22 18:48:49 +11:00
AP_Relay AP_Relay: update param description to inclde IOMCU 2021-09-28 09:40:25 +10:00
AP_RobotisServo AP_RobotisServo: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: move RPM sensor logging into AP_RPM 2022-01-11 11:09:26 +11: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_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: Fix multi #include's 2021-12-21 10:38:46 +11:00
AP_Scripting AP_Scripting: support feild alias s 2022-01-06 22:30:58 +11:00
AP_SerialLED AP_SerialLED: removed empty constructors 2021-11-01 10:24:40 +11:00
AP_SerialManager AP_SerialManager: fixed AP_Periph GPS 2021-12-21 20:14:55 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: rename for AHRS restructuring 2021-07-21 21:01:39 +10:00
AP_Soaring AP_Soaring: Add speed-to-fly calculation used if SOAR_CRSE_ARSPD<0. 2021-12-16 07:12:24 +11:00
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: add reset throttle I function 2021-12-22 18:46:14 +11:00
AP_TempCalibration AP_TempCalibration: Remove pointer check before delete 2021-02-04 09:01:19 +11:00
AP_TemperatureSensor AP_TemperatureSensor: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Terrain AP_Terrain: cast result of labs to unsigned 2021-11-30 10:16:01 +11:00
AP_Torqeedo AP_Torqeedo: simplify conversion of master error code into string 2021-12-06 14:50:15 +11:00
AP_ToshibaCAN AP_ToshibaCAN: Fix multi #include's 2021-12-21 10:38:46 +11: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: create and use AP_OPTICALFLOW_ENABLED 2021-12-29 18:12:03 +11:00
AP_Vehicle AP_Vehicle: move INS notch filter logging into INS 2022-01-05 16:34:36 +11:00
AP_VideoTX AP_SmartAudio: fix a bug that would starve the lower priority thread, such as scripting. 2021-12-21 16:03:44 +09:00
AP_VisualOdom AP_VisualOdom: added VOXL backend type 2021-12-27 12:32:41 +11:00
AP_Volz_Protocol AP_Volz_Protocol: omit code that breaks build for herepro 2021-07-02 08:50:16 +10:00
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
APM_Control AR_AttitudeControl: get_throttle_speed_pid_info.FF includes base throttle 2022-01-07 09:36:44 +09: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: minor comment improvement 2021-12-01 08:54:18 +09:00
doc doc: Fix typos 2016-05-13 19:20:06 -03:00
Filter Filter: optimize hot parts of notch filter updates 2021-12-22 18:23:33 +11:00
GCS_MAVLink GCS_MAVLink: don't use avoidance on plane 2022-01-11 09:51:47 +11:00
PID
RC_Channel RC_Channel: don't use avoidance on plane 2022-01-11 09:51:47 +11:00
SITL SITL: support KSXT message for Unicore NMEA 2022-01-11 10:34:11 +11:00
SRV_Channel SRV_Channel: minor param desc format fix 2021-12-21 14:45:49 +09:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00