ardupilot/libraries
Andrew Tridgell eca8cf3414 HAL_ChibiOS: save flash on boards that are critically low
move to single OSD font on some boards

this saves about 12k on these boards. They were also extremely close
to overflowing flash, under 2k on some

Now that we support having an OSD font on the microSD card (where
available) we can reduce built in fonts without a large functionality
impact

This also disables some less used features on these boards:

 - generator support
 - object avoidance path planning
 - precision landing

This will give us some breathing room on these boards
2021-04-13 09:58:59 +10:00
..
AC_AttitudeControl AC_PosControl_Sub: update for new position controller changes 2021-04-03 12:07:59 +09:00
AC_Autorotation AC_Autorotation: Add copter vehicle type to flight log metadata 2021-02-08 22:09:49 -05:00
AC_AutoTune AC_AutoTune: report step in lower case 2021-02-06 14:45:53 +09:00
AC_Avoidance AC_Avoid: Change parameter defaults 2021-04-05 13:43:28 +09:00
AC_Fence AC_Fence: remove unused declaration 2021-03-24 08:50:48 +11:00
AC_InputManager
AC_PID AC_PID: library update and additional functions 2021-04-03 12:07:59 +09:00
AC_PrecLand AC_PrecLand: correct @User field in ACC_P_NSE documentation 2020-09-22 14:56:04 +10:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_WPNav: remove unassigned _track_desired 2021-04-08 16:13:51 +09:00
AP_AccelCal AP_AccelCal: rename from review feedback 2021-01-21 13:09:21 +11:00
AP_ADC
AP_ADSB AP_ADSB: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: move handling of last-seen-SYSID_MYGCS up to GCS base class 2021-04-07 17:54:21 +10:00
AP_AHRS AP_AHRS: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_Airspeed AP_Airspeed: added ASP5033 driver 2021-03-28 07:50:34 +11:00
AP_Arming AP_Arming: check for only first compass being disabled 2021-03-31 19:16:01 +11:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Baro AP_Baro: work around bad WHOAMI read on DPS310 2021-03-31 13:26:52 +11:00
AP_BattMonitor AP_BattMoniter: add reset remaining per-instance rename existing to _mask 2021-03-31 19:21:59 +11:00
AP_Beacon AP_Beacon: added const 2020-11-11 16:14:22 -08:00
AP_BLHeli Update serial-4way-if to v20005 2021-03-18 08:10:08 +11:00
AP_BoardConfig AP_BoardConfig: added get_heater_duty_cycle() 2021-02-09 11:32:19 +11:00
AP_Button AP_Button: update BTN_FUNCx param descriptions 2021-02-26 12:30:13 +11:00
AP_Camera AP_Camera: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_CANManager AP_CANManager: do select before sending passthrough message 2021-03-30 08:05:00 +11:00
AP_Common AP_Common: added common nmea_printf code 2021-04-13 09:36:52 +10:00
AP_Compass AP_Compass: add memsic MMC5883 driver 2021-04-07 16:03:57 +10:00
AP_DAL AP_DAL: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: use enum class for protocol 2021-03-30 21:40:35 +11:00
AP_ESC_Telem AP_ESC_Telem: Fix copy & paste typo 2021-02-24 12:49:05 +11:00
AP_ExternalAHRS AP_ExternalAHRS: added frontend/backend split 2021-04-13 09:36:52 +10:00
AP_Filesystem AP_Filesystem: add @SYS/uarts.txt 2021-02-20 14:37:11 +11:00
AP_FlashStorage AP_FlashStorage: support STM32G4 2021-03-23 12:01:20 +11:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: change for AP::terrain as a pointer 2021-04-07 20:56:01 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_GPS AP_GPS: use common nmea_printf() 2021-04-13 09:36:52 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_HAL AP_HAL: update hardware definitions for navigator r3 2021-04-07 15:08:18 -04:00
AP_HAL_ChibiOS HAL_ChibiOS: save flash on boards that are critically low 2021-04-13 09:58:59 +10:00
AP_HAL_Empty AP_HAL_Empty: removed assert calls 2021-03-25 14:03:40 +11:00
AP_HAL_Linux HAL_Linux: added --defaults option to Linux HAL 2021-04-13 09:36:52 +10:00
AP_HAL_SITL HAL_SITL: use common nmea_printf() 2021-04-13 09:36:52 +10:00
AP_Hott_Telem AP_Hott_Telem: use GPS single-char representation of fix type 2021-02-18 08:59:23 +11:00
AP_ICEngine AP_ICEngine: make it obvious that update_idle_gov does nothing if disabled 2021-02-18 09:45:30 +11:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: fixed handling of more than 3 accel/gyro instances 2021-04-13 09:36:52 +10:00
AP_InternalError AP_InternalError: added invalid_arguments failure 2021-04-03 12:07:59 +09:00
AP_IOMCU AP_IOMCU: ChibiOS 20.3.x build fix 2021-03-23 12:01:20 +11: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: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Landing AP_Landing: Autoenable fence if required when landing was aborted 2021-03-05 14:52:46 +11:00
AP_LandingGear AP_LandingGear: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_LeakDetector AP_LeakDetector: update leak pin for navigator r3 2021-04-07 15:08:18 -04:00
AP_Logger AP_Logger: make log file erase async 2021-04-06 10:40:40 +10: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: add SplineCurve library 2021-04-03 12:07:59 +09:00
AP_Menu
AP_Mission AP_Mission: add restart_current_nav_cmd 2021-04-03 12:07:59 +09:00
AP_Module AP_Module: fix example 2021-03-03 18:07:38 +11:00
AP_Motors AP_Motors: Constrain get_throttle_hover value with allowed range 2021-04-01 13:06:02 +09:00
AP_Mount AP_Mount: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_MSP AP_MSP: removed date/time from MSP 2021-02-13 19:24:48 +11:00
AP_NavEKF AP_NavEKF: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF2 AP_NavEKF2: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF3 AP_NavEKF3: simplify taking of GPS measurements 2021-03-23 15:11:33 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA: fix example 2021-03-03 18:07:38 +11:00
AP_Notify AP_Notify: UAVCAN_RGB_LED: don't init if no UAVCAN backends 2021-04-06 10:45:09 +10:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_OpticalFlow AP_OpticalFlow:add UPFLOW sensor 2021-03-24 08:42:14 +09:00
AP_OSD AP_OSD: add kilo symbol to RPM panel 2021-04-13 09:08:36 +10:00
AP_Parachute AP_Parachute: move sink rate check to new method 2020-10-06 16:14:59 +11:00
AP_Param AP_Param: added blimp frame type 2021-03-31 12:27:07 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Update timeout values to use 64-bit calls 2020-10-28 18:25:45 +11:00
AP_Proximity AP_Proximity: Check for stray faces and add new param for filter cut off freq 2021-04-05 14:09:17 +09:00
AP_Radio
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: TeraRangerI2C added case of out of range measurement 2021-04-06 10:44:13 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: move AP_VideoTX to AP_VideoTX 2021-02-23 11:43:32 +11:00
AP_RCTelemetry AP_RCTelemetry: prioritize pitmode changes over power changes 2021-04-12 16:22:36 +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 crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: add explicit RPM_TYPE_SITL 2021-03-02 15:41:44 +11:00
AP_RSSI AP_RSSI: handle init ordering with MSP 2020-11-17 10:01:54 +11:00
AP_RTC AP_RTC: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: fix example 2021-03-03 18:07:38 +11:00
AP_Scripting AP_Scripting: add position light example 2021-04-13 09:23:59 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: add support for the SmartAudio protocol 2021-02-17 18:23:33 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: peek_point method peeks at next point 2021-04-03 12:07:59 +09:00
AP_Soaring AP_Soaring: Ensure minimum cruise times are respected when RC switch position is changed. 2021-04-12 18:38:10 +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: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: Clarify TECS_THR_DAMP and TECS_LAND_TDAMP descriptions. 2021-03-03 18:05:22 +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: make AP::terrain return a pointer 2021-04-07 20:56:01 +10:00
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 2020-08-19 17:31:09 +10:00
AP_Tuning AP_Tuning: use AUX_PWM_TRIGGER_LOW and AUX_PWM_TRIGGER_HIGH 2021-02-10 18:48:06 +11:00
AP_UAVCAN AP_UAVCAN: Add ardupilot.gnss.Status 2021-03-12 09:39:55 +11:00
AP_Vehicle AP_Vehicle: addlow SRV_Channels to be initialized 2021-04-06 10:24:04 +10:00
AP_VideoTX AP_VideoTX: don't try to change pitmode on anything other than SA2.1 2021-04-12 16:22:36 +10:00
AP_VisualOdom AP_VisualOdom: fix T265 criteria for aligning to AHRS 2021-02-10 18:37:45 +11:00
AP_Volz_Protocol AP_Volz_Protocol scaling bugfix 2020-12-08 15:03:26 +11:00
AP_WheelEncoder AP_WheelEncoder: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 2020-09-09 11:56:00 +09:00
AP_WindVane AP_WindVane: Add missing const in member functions 2021-02-03 18:45:14 +11:00
APM_Control AR_AttitudeControl: reset speed filter and I term when stopped 2021-03-04 09:07:32 +09:00
AR_WPNav AR_WPNav: apply_speed_min used for overshoot limits 2020-12-08 11:29:21 +11:00
doc
Filter Filter: fixed reset of filters to first value 2021-02-05 15:01:22 +11:00
GCS_MAVLink GCS_MAVLink: move handling of last-seen-SYSID_MYGCS up to GCS base class 2021-04-07 17:54:21 +10:00
PID
RC_Channel RC_Channel: return MAV_RESULT_FAILED from do_aux_function if invalid function 2021-03-31 11:36:09 +11:00
SITL SITL: add documentation fo rsimulated barometers 2021-04-10 11:28:22 +10:00
SRV_Channel SRV_Channel: add SERVO_DSHOT_RATE and propagate to rcout 2021-04-06 10:24:04 +10:00
StorageManager StorageManager: Add missing const in member functions 2021-02-03 18:45:14 +11:00