ardupilot/libraries
Peter Barker 10bc615b57 AP_GPS: add include for GCS_MAVLink.h
The initialisation of the GPS_Fix enumeration is made from the mavlink headers.

We should probably move away from this, converting from our own enumeration to the mavlink enumeration when required (emitting mavlink packets and receiving in AP_GPS_MAV)
2022-07-13 18:32:35 +10:00
..
AC_AttitudeControl AC_AttitudeControl: remove PosControl_Sub 2022-07-05 16:00:03 -03:00
AC_Autorotation AC_Autorotation: tidy includes 2022-05-03 09:14:58 +10:00
AC_AutoTune AC_AutoTune: fix tradheli bug with load gain set 2022-06-20 13:00:53 +09:00
AC_Avoidance AC_Avoidance: tidy includes 2022-05-03 09:14:58 +10:00
AC_Fence AC_Fence: Move {Plane} mark from Value to Param 2022-05-10 09:35:11 +10: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: limit COMMAND_ACKs accepted for vehicle pose confirmation 2022-05-25 17:55:55 +10:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: fix sagetech MXS SDK linking error 2022-06-14 07:10:17 -07:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: add note to desc's on how to determine GPIO pin numbers 2022-04-24 08:21:01 +09:00
AP_AHRS AP_AHRS_view: add rotate method to move from AHRS to AHRS view referance frames 2022-06-21 10:01:30 +10:00
AP_Airspeed AP_Airspeed: fix clang++ warnings on static inits 2022-06-28 10:20:30 +10:00
AP_AIS AP_AIS: move to config.h pattern 2022-07-13 18:14:12 +10:00
AP_Arming AP_Arming: added Scripting2 CAN protocol to switch 2022-07-03 08:21:55 +10:00
AP_Avoidance AP_Avoidance: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_Baro AP_Baro: add support for ICP101XX 2022-06-28 11:59:04 +10:00
AP_BattMonitor AP_BattMonitor: make healthy() check all configured monitors 2022-06-24 11:13:16 +10:00
AP_Beacon AP_Beacon: stop passing serialmanager into beacon constructor 2022-06-11 16:02:37 +10:00
AP_BLHeli AP_BLHeli: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_BoardConfig AP_BoardConfig: remove reference to CONFIG_ARCH_BOARD_* 2022-06-28 11:21:30 +10:00
AP_Button AP_Button: pre-arm displays gpio vs servo_ch conflict 2022-04-26 15:19:28 +09:00
AP_Camera AP_Camera: add note to desc's on how to determine GPIO pin numbers 2022-04-24 08:21:01 +09:00
AP_CANManager AP_CANManager: added scripting2 protocol 2022-07-03 08:21:55 +10:00
AP_Common AP_Common: correct comments on get_alt_cm and change_alt_frame 2022-06-30 20:08:24 +10:00
AP_Compass AP_Compass: fix clang++ warnings on static inits 2022-06-28 10:20:30 +10:00
AP_CustomRotations AP_CustomRotations: fix param refrencing 2022-04-20 18:25:57 +10:00
AP_DAL AP_DAL: added set source events for EKF3 2022-05-31 09:17:37 +10: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: fixed bug in Lutan driver 2022-06-09 21:10:37 +10:00
AP_ESC_Telem AP_ESC_Telem: fixed race condition in update_rpm() 2022-07-13 17:33:00 +10:00
AP_ExternalAHRS AP_ExternalAHRS: correct compilation if AP_Baro_ExternalAHRS isn't available 2022-05-25 18:19:00 +10:00
AP_FETtecOneWire AP_FETTecOneWire: Fix the recent change of NUM_SERVO_CHANNELS > 24 2022-06-22 11:51:23 +10:00
AP_Filesystem AP_Filesystem: fixed gets() posix compat function 2022-05-31 09:26:43 +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: inhibit maintenance warning based on GEN_OPTIONS bit 2022-05-25 18:17:05 +10:00
AP_GPS AP_GPS: add include for GCS_MAVLink.h 2022-07-13 18:32:35 +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: make sure the parameters are updated at least once on startup 2022-06-14 10:09:18 +10:00
AP_HAL AP_HAL: fix python files exec permissions 2022-06-08 08:16:42 +09:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: allow crashdump even if !HAL_GCS_ENABLED 2022-07-13 18:23:37 +10:00
AP_HAL_Empty AP_HAL_Empty: move implementations of functions to header 2022-06-23 12:38:41 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_HAL_Linux AP_HAL_Linux: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_HAL_SITL HAL_SITL: catch ubsan errors into a log file 2022-07-12 11:00:08 +10:00
AP_Hott_Telem AP_Hott_Telem: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ICEngine AP_ICEngine: added option to force low throttle on engine off 2022-07-10 06:56:58 +10: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: remove voiding of parameter 2022-07-05 09:54:53 +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: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_JSButton
AP_KDECAN AP_KDECAN: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_L1_Control AP_L1_Control: use AP_GROUPINFO instead of AP_GROUPINFO_FRAME 2022-05-10 09:35:11 +10:00
AP_Landing AP_Landing : correct comment spelling 2022-05-24 20:27:45 +09:00
AP_LandingGear AP_LandingGear: add note to desc's on how to determine GPIO pin numbers 2022-04-24 08:21:01 +09:00
AP_LeakDetector AP_LeakDetector: check for valid analog pin 2021-10-06 18:42:51 +11:00
AP_Logger AP_Logger: Log Structure: remove comma on included AIS structure 2022-07-12 09:39:54 +10:00
AP_LTM_Telem AP_LTM_Telem: add AP_LTM_TELEM_ENABLED 2022-06-28 20:19:41 +10:00
AP_Math AP_Math: added rounding functions 2022-07-12 11:00:08 +10:00
AP_Menu
AP_Mission AP_Mission: skip aux function in determining if a takeoff 2022-07-12 10:34:26 +10:00
AP_Module AP_Module: tidy includes 2022-05-03 09:14:58 +10:00
AP_Motors AP_Motors: reuse spool_step for code refactoring 2022-07-11 08:39:34 +09:00
AP_Mount AP_Mount: fixup handle do-gimbal-manager-pitchyaw flags 2022-06-29 10:56:48 +09:00
AP_MSP AP_MSP: fix line ending 2022-06-08 08:16:42 +09:00
AP_NavEKF AP_NavEKF: re-implemented EKF ring buffer 2022-06-24 20:25:39 +10:00
AP_NavEKF2 AP_NavEKF2: fixed undefined behaviour in logging 2022-07-12 11:00:08 +10:00
AP_NavEKF3 AP_NavEKF3: only include log struture if enabled 2022-07-13 18:14:12 +10: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: tidy includes 2022-05-03 09:14:58 +10:00
AP_OLC AP_OLC: tidy includes 2022-05-03 09:14:58 +10:00
AP_ONVIF AP_ONVIF: fix executable permission and trailing whitespace 2022-06-08 08:16:42 +09:00
AP_OpticalFlow AP_OpticalFlow: tidy includes 2022-05-03 09:14:58 +10:00
AP_OSD AP_OSD: update parameter menu flightmodes for plane and copter. 2022-05-30 11:16:39 +09:00
AP_Parachute AP_Parachute: added arming check for chute released 2021-11-18 15:21:15 +11:00
AP_Param AP_Param: make configured_in_storage() private 2022-06-06 13:11:50 +10:00
AP_PiccoloCAN AP_PiccoloCAN: update ESC_BM Bitmask 2022-05-22 12:07:37 +10:00
AP_Proximity AP_Proximity: move to config.h pattern and only include log structures if enabled 2022-07-13 18:14:12 +10:00
AP_Radio AP_Radio: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_Rally AP_Rally: clarify that rtl altitude is in cm amsl 2022-07-12 11:06:27 +10:00
AP_RAMTRON AP_RAMTRON: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_RangeFinder AP_RangeFinder: make LeddarOne calculations more efficient 2022-06-22 21:15:18 +10:00
AP_RCMapper AP_RCMapper: Increase parameter metadata range to match NUM_RC_CHANNELS 2022-06-21 09:57:44 +10:00
AP_RCProtocol AP_RCProtocol: reset UART on RX failure for CRSF 2022-06-15 17:20:36 +10:00
AP_RCTelemetry AP_RCTelemetry: don't spam mode changes on CRSF startup 2022-06-15 17:20:36 +10:00
AP_Relay AP_Relay:Prevent operation for sim-on-hardware,add logs 2022-05-02 10:54:02 +10:00
AP_RobotisServo AP_RobotisServo: disable with minmimize features and 1mb flash 2022-06-15 18:05:44 +10:00
AP_ROMFS AP_ROMFS: tidy includes 2022-05-03 09:14:58 +10:00
AP_RPM AP_RPM: fixed use of configured() vs configured_in_storage() 2022-06-06 13:11:50 +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: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_Scripting AP_Scripting: added update_rpm() scripting binding 2022-07-13 17:33:00 +10:00
AP_SerialLED AP_SerialLED: enable 32 servo outs 2022-05-22 12:07:37 +10:00
AP_SerialManager AP_SerialManager: add Tramp protocol 2022-07-13 18:22:34 +10: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: Unify coding style for if statements 2022-07-01 11:54:46 -07:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: tidy includes 2022-05-03 09:14:58 +10:00
AP_Torqeedo AP_Torqeedo : correct comment spelling 2022-05-24 20:27:45 +09:00
AP_Tuning AP_Tuning: tidy includes 2022-05-03 09:14:58 +10:00
AP_UAVCAN AP_UAVCAN: allow rangefinder backends to be individually compiled in 2022-06-21 09:15:20 +10:00
AP_Vehicle AP_Vehicle: wire-in tramp support 2022-07-13 18:22:34 +10:00
AP_VideoTX AP_VideoTX: Tramp VTX support 2022-07-13 18:22:34 +10:00
AP_VisualOdom AP_VisualOdom: only include log structure if enabled 2022-07-13 18:14:12 +10:00
AP_Volz_Protocol AP_Volz: disable with minmimize features 2022-06-15 18:05:44 +10:00
AP_WheelEncoder AP_WheelEncoder: fix WheelEncoder_Quadrature timestamp. 2022-06-07 09:59:27 +10: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: tidy includes 2022-05-03 09:14:58 +10:00
APM_Control APM_Control: fixed use of configured() vs configured_in_storage() 2022-06-06 13:11:50 +10:00
AR_Motors AR_Motors: make sure ESC type is initialized early 2022-05-25 17:06:08 +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: fixed test_notchfilter for the change in allocate_filters() 2022-07-10 06:57:29 +10:00
GCS_MAVLink GCS_MAVLink: eliminate get_mavlink_channel 2022-07-12 11:32:57 +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: add mount lock aux function 2022-06-15 09:07:14 +09:00
SITL SITL: fix sim_precland orientation bug 2022-07-11 10:10:55 +10:00
SRV_Channel SRV_Channel: remove ToshibaCAN support 2022-06-10 12:08:05 +09:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00