ardupilot/libraries
Peter Barker 3c3f383601 AP_GPS: decouple status enumeration from MAVLink fix types
This moves us towards being able to compile the GPS library without having the MAVLink headers available.  We shouldn't need those headers when building for Periph.

If the headers are available then we ensure our values match mavlink so we can do a simple cast from one to the other
2023-03-22 14:23:41 +11:00
..
AC_AttitudeControl AC_Attitude:add TKOFF/LAND only weathervane option 2023-03-01 09:51:36 +11:00
AC_AutoTune AC_AutoTune: add option for tuning yaw D-term 2023-03-14 11:01:31 +11:00
AC_Autorotation
AC_Avoidance AC_Avoidance: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_CustomControl
AC_Fence AC_Fence: avoid using struct Location 2023-02-04 22:51:54 +11:00
AC_InputManager
AC_PID AC_PID: AC_PI: fix param defualting 2023-02-06 08:09:13 +09:00
AC_PrecLand AC_Precland: Add option to resume precland after manual override 2023-01-31 19:56:43 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: Provide terrain altitude for surface tracking 2023-03-07 13:41:35 +11:00
APM_Control AMP_Control: Roll and Pitch Controller: don't reset pid_info.I in reset_I calls 2023-01-17 11:19:39 +11:00
AP_ADC
AP_ADSB AP_ADSB: create AP_ADSB_config.h 2023-01-31 11:11:26 +11:00
AP_AHRS AP_AHRS: fixed earth frame accel for EKF3 with significant trim 2023-02-28 17:16:39 +11:00
AP_AIS AP_AIS: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_AccelCal
AP_AdvancedFailsafe AP_AdvancedFailsafe: add and use AP_ADVANCEDFAILSAFE_ENABLED 2023-02-08 19:00:13 +11:00
AP_Airspeed AP_Airspeed: save some bytes by making conversion structure static 2023-03-10 08:49:36 +11:00
AP_Arming AP_Arming: call hal GPIO check 2023-03-22 09:27:35 +11:00
AP_Avoidance
AP_BLHeli
AP_Baro AP_Baro: fix bug in alt error arming check 2023-02-10 06:46:08 +11:00
AP_BattMonitor AP_BattMonitor: rename fuel_remain_pct to fuel_remain_scale 2023-03-15 19:08:18 +11:00
AP_Beacon
AP_BoardConfig AP_BoardConfig: support multiple heater pins 2023-03-15 19:08:53 +11:00
AP_Button AP_Button: implement parameter CopyFieldsFrom and use it 2023-01-03 11:08:43 +11:00
AP_CANManager AP_CANManager: add and use option to compile SLCAN support out of code 2023-03-15 19:08:09 +11:00
AP_CSVReader AP_CSVReader: add simple CSV reader 2023-01-17 11:21:48 +11:00
AP_Camera AP_Camera: correct config boards include 2023-03-19 09:08:41 +11:00
AP_CheckFirmware
AP_Common AP_Common: add NMEA output to a buffer 2023-02-07 21:12:07 +11:00
AP_Compass AP_Compass: specify compass feature enables for periph in chibios_hwdef.py 2023-03-12 09:35:35 +11:00
AP_CustomRotations
AP_DAL AP_DAL: use MAX_EKF_CORES instead of INS_MAX_INSTANCES in ekf_low_time_remaining 2023-03-21 10:04:16 +11:00
AP_DDS AP_DDS: Add initial DDS Client support 2023-03-22 09:22:36 +11:00
AP_Declination AP_Declination: update magnetic field tables 2023-01-03 11:01:32 +11:00
AP_Devo_Telem
AP_EFI AP_EFI: add defines for Lutan and MegaSquirt 2023-03-21 09:01:13 +11:00
AP_ESC_Telem AP_ESC_Telem: add and use an AP_ESC_Telem_config.h 2023-03-10 08:48:24 +11:00
AP_ExternalAHRS AP_ExternalAHRS: specify AP_EXTERNALAHRS_ENABLED for periph in chibios_hwdef.py 2023-03-12 09:35:35 +11:00
AP_FETtecOneWire AP_FETtecOneWire: change comments to not use @param 2022-12-30 09:54:09 +11:00
AP_Filesystem AP_Filesystem: support file rename 2023-03-05 09:42:48 +11:00
AP_FlashIface
AP_FlashStorage AP_FlashStorage: fix spelling 2023-02-14 14:33:01 +00:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: rename HAL_INS_ENABLED to AP_INERTIALSENSOR_ENABLED 2023-01-03 10:28:42 +11:00
AP_GPS AP_GPS: decouple status enumeration from MAVLink fix types 2023-03-22 14:23:41 +11:00
AP_Generator AP_Generator: correct config boards include 2023-03-19 09:08:41 +11:00
AP_Gripper AP_Gripper: correct config boards include 2023-03-19 09:08:41 +11:00
AP_GyroFFT AP_GyroFFT: change default FFT frequency range to something more useful 2023-01-24 10:56:33 +11:00
AP_HAL AP_HAL: GPIO: add arming check 2023-03-22 09:27:35 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: GPIO: retry pins after ISR flood and add arming check 2023-03-22 09:27:35 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: Readme update 2023-01-31 18:00:25 +11:00
AP_HAL_Empty
AP_HAL_Linux AP_HAL_Linux: Update GPIO and RCInput for pi version change 2023-02-22 21:10:04 -08:00
AP_HAL_SITL SITL: Send VCAS in Flightgear packet. 2023-02-20 05:37:21 -08:00
AP_Hott_Telem
AP_ICEngine
AP_IOMCU AP_IOMCU: support forcing heater to enabled with a feature bit 2023-03-07 10:33:24 +11:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: move from INS_ top level parameters to INS 2023-03-21 10:04:16 +11:00
AP_InternalError AP_InternalError: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_JSButton
AP_KDECAN
AP_L1_Control AP_L1_Control: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LTM_Telem
AP_Landing AP_Landing: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: factor Write_PSC[NED] methods to save bytes 2023-03-10 14:47:33 -08:00
AP_MSP AP_MSP: Increase DisplayPort UART TX buffer to prevent OSD corruption 2023-02-15 12:31:37 +11:00
AP_Math AP_Math: add waf argument to get consistent builds 2023-02-17 20:48:45 +11:00
AP_Menu
AP_Mission AP_Mission: correct missing transitive include problem 2023-03-19 09:08:41 +11:00
AP_Module
AP_Motors AP_Motors: add method for scripting to set external limit flags 2023-03-07 10:12:30 +11:00
AP_Mount AP_Mount: remove redundant constructors 2023-03-07 13:40:54 +11:00
AP_NMEA_Output AP_NMEA_Output: fix GPGGA hdop, fix, sats 2023-03-14 12:45:47 -07:00
AP_NavEKF AP_NavEKF: ensure gyro biases are numbers 2023-03-21 12:18:33 +11:00
AP_NavEKF2 AP_NavEKF2: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_NavEKF3 AP_NavEKF3: use INS_MAX_INSTANCES instead of MAX_EKF_CORES for IMU mask 2023-03-21 10:04:16 +11:00
AP_Navigation AP_Navigation: avoid using struct Location 2023-02-04 22:51:54 +11:00
AP_Notify AP_Notify: correct config boards include 2023-03-19 09:08:41 +11:00
AP_OLC AP_OLC: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_ONVIF
AP_OSD AP_OSD: move OSD minimizement to minimize_features.inc 2023-03-21 08:47:53 +11:00
AP_OpenDroneID AP_OpenDroneID: fixed mavlink enum 2023-03-07 20:35:13 +09:00
AP_OpticalFlow
AP_Parachute AP_Parachute: use relay singleton in Parachute 2023-01-03 10:19:54 +11:00
AP_Param AP_Param: print length of defaults list as part of key dump 2023-01-24 10:16:56 +11:00
AP_PiccoloCAN AP_PiccoloCAN: tidy AP_EFI defines 2023-03-21 09:01:13 +11:00
AP_Proximity AP_Proximity: reduce SF45b mode filter to 3 elements 2023-03-01 18:22:22 +11:00
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: tidy enablement RC FastSBUS support 2023-03-21 12:08:06 +11:00
AP_RCTelemetry AP_RCTelemetry: add and use AP_RCTelemetry_config.h 2023-03-21 08:47:53 +11:00
AP_ROMFS
AP_RPM
AP_RSSI
AP_RTC
AP_Radio
AP_Rally
AP_RangeFinder AP_RangeFinder: allow re-init if no sensors found 2023-03-06 19:48:07 +11:00
AP_Relay
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: rename HAL_SCHEDULER_ENABLED to AP_SCHEDULER_ENABLED 2023-02-28 11:26:04 +11:00
AP_Scripting AP_Scripting:provide altitude loss safety abort for plane aerobatics 2023-03-20 04:48:57 -07:00
AP_SerialLED AP_SerialLED: add defines for some AP_Notify LED libraries 2023-03-07 10:30:13 +11:00
AP_SerialManager AP_SerialManager: Add enum for DDS over serial 2023-03-22 09:22:36 +11:00
AP_ServoRelayEvents
AP_SmartRTL
AP_Soaring
AP_Stats
AP_TECS AP_TECS: protect against low airspeed in reset 2023-02-19 10:20:03 -08:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor:correct TEMP sensor metadata 2023-01-24 11:16:51 +11:00
AP_Terrain AP_Terrain: terrain offset max default to 30m 2023-03-14 11:59:49 +11:00
AP_Torqeedo AP_Torqeedo: add and use AP_Generator_config.h 2023-03-10 08:48:24 +11:00
AP_Tuning
AP_UAVCAN AP_UAVCAN: tidy AP_EFI defines 2023-03-21 09:01:13 +11:00
AP_Vehicle AP_Vehicle: Add DDS initialization and params to the vehicle if enabled 2023-03-22 09:22:36 +11:00
AP_VideoTX AP_VideoTX: protect vtx from pitmode changes when not enabled or not armed 2023-02-15 19:30:28 +11:00
AP_VisualOdom AP_VisualOdom: handle voxl yaw and pos jump on reset 2023-01-24 11:07:02 +11:00
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch AP_Winch: Fix baud rate handling 2023-03-04 07:59:23 +09:00
AP_WindVane AP_WindVane: use body frame when setting apparent wind in sitl physics backend 2023-03-15 12:58:49 +00:00
AR_Motors
AR_WPNav AR_WPNav: avoid using struct Location 2023-02-04 22:51:54 +11:00
Filter Filter: HarmonicNotch: update FREQ description 2023-03-15 18:53:55 +11:00
GCS_MAVLink GCS_MAVLink: routing: do not process our own packets locally 2023-03-22 09:26:19 +11:00
PID PID: use new defualt pattern 2023-01-24 10:16:56 +11:00
RC_Channel RC_Channel:rename 173 option more appropriately 2023-03-21 14:04:07 +00:00
SITL SITL: add support for auxiliary IMUs 2023-03-21 10:04:16 +11:00
SRV_Channel SRV_Channel: narrow include for configuration 2023-01-25 22:30:55 +11:00
StorageManager StorageManager: fixed startup crash 2023-03-12 07:15:01 +11:00
doc