ardupilot/libraries
Andrew Tridgell 0f6f738a33 AP_GPS: added option to decode RTCM injected data
this allows for redundent RTCM links (eg. WiFi and SiK links for light
show drones) without causing corruption into the GPS.

If the GPS_DRV_OPTION bit is set then we instantiate a separate RTCM3
decoder per mavlink channel, and only inject when we get a full packet
that passes the RTCM 24 bit CRC
2024-03-06 19:38:06 +11:00
..
AC_AttitudeControl AC_AttitudeControl: Tradheli- fix inverted mode collective handling 2024-03-05 10:24:06 +09: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 AP_OAPathPlanner: using static constexpr instead const 2024-02-20 09:30:13 +11:00
AC_CustomControl AC_CustomControl: move include of logging header to cpp file 2024-02-29 20:01:39 +11:00
AC_Fence AC_Fence: ensure fencepoint protocol not compiled in if not HAL_GCS_ENABLED 2024-02-20 11:47:32 +11:00
AC_InputManager
AC_PID AC_PID: avoid use of uninitialised stack data in example 2024-02-24 08:19:50 +09:00
AC_PrecLand AC_PrecLand: added get_target_location and get_target_velocity 2024-03-06 09:39:51 +11:00
AC_Sprayer
AC_WPNav AC_WPNav: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
APM_Control AR_PosControl: adjust for logging having moved into AC_AttitudeControl 2024-02-29 19:27:47 +11:00
AP_ADC
AP_ADSB AP_ADSB: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_AHRS AP_AHRS: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +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_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: Remove MR72 2024-02-27 10:59:41 +11:00
AP_Avoidance
AP_BLHeli
AP_Baro Updated identification code per the datasheet 2024-01-23 11:08:33 +11:00
AP_BattMonitor AP_BattMonitor: tidy defines in scripting backend 2024-02-14 23:43:41 +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_CANManager AP_CANManager: Add multiCAN interface 2024-02-27 10:59:41 +11:00
AP_CSVReader
AP_Camera AP_Camera: fix video recording while armed 2024-02-15 12:17:44 +11:00
AP_CheckFirmware AP_CheckFirmware: add separate AP_CheckFirmwareDefine for correctly setting firmware versions 2024-02-21 18:54:17 +11:00
AP_Common AP_Common: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_Compass AP_Compass: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_CustomRotations AP_CustomRotations: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_DAL AP_DAL: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_DDS AP_DDS: Add IMU publisher 2024-03-03 07:04:59 +11:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: map DroneCAN debug levels to MAV_SEVERITY levels 2024-02-22 15:03:01 +11:00
AP_EFI AP_EFI: add missing include 2024-01-11 15:29:54 +11:00
AP_ESC_Telem AP_ESC_Telem: move defaulting of HAL_WITH_ESC_TELEM for periph 2024-03-05 12:37:40 +11:00
AP_ExternalAHRS AP_ExternalAHRS: added missing #if AHRS logging 2024-03-05 17:11:38 +11:00
AP_ExternalControl
AP_FETtecOneWire
AP_Filesystem AP_Filesystem: don't show directory entries for empty @ filesystems 2024-02-28 18:47:22 +11:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Frsky_Telem
AP_GPS AP_GPS: added option to decode RTCM injected data 2024-03-06 19:38:06 +11:00
AP_Generator AP_Generator: tidy RichenPower defines 2024-02-20 09:27:43 +11:00
AP_Gripper AP_Gripper: move gripper up to AP_Vehicle 2024-02-21 21:05:12 +11:00
AP_GyroFFT AP_GyroFFT: move logger object up to AP_Vehicle 2024-02-13 10:54:29 +11:00
AP_HAL AP_HAL: use NoVehicle by default 2024-03-02 17:55:43 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS/hwdef: add LED_SAFETY for JFB100 board definition 2024-03-06 18:52:35 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: bugfixes 2024-03-03 07:29:35 +11:00
AP_HAL_Empty
AP_HAL_Linux AP_HAL_Linux: fixed get_baud_rate() 2024-02-29 11:00:40 +11:00
AP_HAL_SITL AP_HAL_SITL: fixed get_baud_rate() 2024-02-29 11:00:40 +11:00
AP_Hott_Telem AP_Hott_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_ICEngine AP_ICEngine: correct compilation when ICEngine disabled 2024-02-20 09:16:23 +11:00
AP_IOMCU AP_IOMCU: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: fixed wait_for_sample() in examples 2024-02-28 19:22:14 +11:00
AP_InternalError
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: made test pass/fail 2024-02-28 19:22:14 +11: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: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +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: move logging of PSC messages into AC_AttitudeControl 2024-02-29 19:27:47 +11:00
AP_MSP AP_MSP: correct compilation when GPS disabled 2024-02-25 12:47:40 +11:00
AP_Math AP_Math: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_Menu
AP_Mission AP_Mission: move gripper up to AP_Vehicle 2024-02-21 21:05:12 +11:00
AP_Module AP_Module: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Motors AP_Motors: smoother ramp down in output_motor_mask 2024-03-06 08:01:52 +11:00
AP_Mount AP_Mount: squash static_assert warnings 2024-02-22 14:40:55 +11:00
AP_NMEA_Output AP_NMEA_Output: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +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: do not trust number of beacons to not change 2024-02-28 18:37:42 +11:00
AP_Navigation
AP_Networking AP_Networking: fixed network bootloader without serial manager 2024-01-30 12:32:23 +11:00
AP_Notify AP_Notify: Add send_text for scripting use 2024-02-07 23:52:30 +00:00
AP_OLC
AP_ONVIF
AP_OSD AP_OSD: use internal enumeration in place of mavlink enumeration 2024-02-20 22:09:53 +11:00
AP_OpenDroneID
AP_OpticalFlow AP_OpticalFlow: correct comments on AP_OpticalFlow methods 2024-01-22 19:14:42 +11:00
AP_Parachute AP_Parachute: do relay conversion if ever enabled 2024-02-07 19:07:29 +11:00
AP_Param AP_Param: move serial_manager parameters up to base class 2024-02-29 12:12:19 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: move mutlican to AP_CANSensor 2024-02-27 10:59:41 +11:00
AP_RAMTRON
AP_RCMapper AP_RCMapper: add rcmapper config 2024-02-10 11:47:10 +11:00
AP_RCProtocol AP_RCProtocol: correct assignment of new_input in rcprotocol detecion 2024-02-23 11:23:13 +11:00
AP_RCTelemetry AP_RCTelemetry: correct CSRF->CRSF 2024-02-19 21:38:39 +11:00
AP_ROMFS AP_ROMFS: fixed duplicate directories 2024-02-22 07:43:16 +11:00
AP_RPM
AP_RSSI
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_Radio AP_Radio: tidy AP_Radio includes 2024-02-05 09:26:14 +11:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RangeFinder AP_RangeFinder: move multican to AP_CANSensor 2024-02-27 10:59:41 +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
AP_SBusOut
AP_Scheduler AP_Scheduler: fixed example test to pass/fail 2024-02-28 19:22:14 +11:00
AP_Scripting AP_Scripting: fixed race condition in ship landing 2024-03-06 09:39:51 +11:00
AP_SerialLED
AP_SerialManager AP_SerialManager: move serial_manager parameters up to base class 2024-02-29 12:12:19 +11:00
AP_ServoRelayEvents
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: Only reset statistics if the user explicitly sets AP_Stats_RESET parameter to zero. 2024-02-21 18:28:23 +11:00
AP_TECS AP_TECS: fixed adjusting speed without airspeed sensor 2024-03-03 20:28:38 +11:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: correct compilation when GCS not available 2024-02-16 12:52:04 -08:00
AP_Terrain AP_Terrain: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Torqeedo AP_Torqeedo: correct compilation when GCS not available 2024-02-16 09:02:14 +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: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: use Odometry quality 2024-02-28 18:52:37 +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
Filter
GCS_MAVLink GCS_MAVLink: pass channel number to AP_GPS on RTCM injection 2024-03-06 19:38:06 +11:00
PID
RC_Channel RC_Channel: allow customisation of position text in aux switch announcement 2024-03-05 23:46:03 +11:00
SITL SITL: fixed precland simulator 2024-03-06 09:39:51 +11:00
SRV_Channel
StorageManager
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
COLCON_IGNORE