Ardupilot2/libraries
Andrew Tridgell 414d3eb670 AP_NavEKF2: don't fuse GPS when EK2_GPS_TYPE=3
when using a vision position system, the user may have vision derived
GPS data coming in using GPS_INPUT msgs. We should not fuse these when
EK2_GPS_TYPE=3 as we end up fusing both vision data and GPS data,
which does not work with the current EK2 code

This change makes it possible to run EK2 and EK3 in parallel in a
Vicon, wityh EK2 using VISION_POSITION_ESTIMATE data and EK3 using
GPS_INPUT (with yaw) data.
2019-08-26 12:27:31 +10:00
..
AC_AttitudeControl AC_AttitudeControl: Support seperate roll and pitch limits 2019-08-03 12:06:32 +09:00
AC_AutoTune AC_AutoTune: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_Avoidance AC_Avoidance: Dijkstra's returns oa-not-required if path has been completed 2019-08-17 09:42:43 +09:00
AC_Fence AC_Fence: tidy get_breach_distance 2019-08-08 16:47:41 +09:00
AC_InputManager
AC_PID AC_HELI_PID: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_Sprayer AC_Sprayer: clean headers 2019-02-19 09:16:26 +11:00
AC_WPNav AC_WPNav: integrate OAPathPlanner 2019-08-17 09:42:43 +09:00
AP_AccelCal AP_AccelCal: remove wrapper around send_text 2019-07-30 10:06:42 +10:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_AdvancedFailsafe AP_Advanced_Failsafe: Reduce scope of AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_AHRS AP_AHRS: var_info is now in GCS_MAVLINK_Parameters 2019-08-14 18:25:43 +10:00
AP_Airspeed AP_Airspeed: examples: var_info is now in GCS_MAVLINK_Parameters 2019-08-14 18:25:43 +10:00
AP_Arming AP_Arming: resolve check_failed compiler warning 2019-08-08 12:53:51 +09:00
AP_Avoidance AP_Avoidance: stop copying adsb vehicle onto stack in src_id_for_adsb_vehicle 2019-07-16 10:30:55 +10:00
AP_Baro AP_Baro: Fix floating point exception with watchdog reset 2019-08-26 12:24:21 +10:00
AP_BattMonitor AP_BattMonitor: add PWM Fuel Level Sensor 2019-08-05 11:35:16 +10:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BLHeli AP_BLHeli: Update to support newer targets and protocols 2019-05-25 09:37:56 +10:00
AP_BoardConfig AP_BoardConfig_CAN: fix bad get_slcan_serial method 2019-07-31 17:24:13 +10:00
AP_Buffer
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera AP_Camera: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Common AP_Common: Make hexadecimal character number conversion method common 2019-08-06 10:14:12 +10:00
AP_Compass AP_Compass: move automatic declination setting into AP_Compass itself 2019-08-13 10:02:13 +10:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-03 12:21:29 +10:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_FlashStorage AP_FlashStorage: fixed build error with -O0 2019-05-15 15:33:48 +10:00
AP_Follow AP_Follow: correct parameter descriptions 2019-05-13 15:34:01 +10:00
AP_Frsky_Telem AP_FrSkyTelem: Refactor battery current interface 2019-07-14 00:28:00 -07:00
AP_GPS AP_GPS: examples: var_info is now in GCS_MAVLINK_Parameters 2019-08-14 18:25:43 +10:00
AP_Gripper AP_Gripper: unify singleton naming to _singleton and get_singleton() 2019-02-10 19:09:58 -07:00
AP_HAL AP_HAL: added I2C ISR count to PersistentData 2019-08-26 09:13:39 +10:00
AP_HAL_ChibiOS ChiBios: Omnibusf4pro hwdef tweak to allow active or passive buzzer 2019-08-26 12:22:53 +10:00
AP_HAL_Empty HAL_Empty: added uartH 2019-07-12 17:01:21 +10:00
AP_HAL_Linux AP_HAL_Linux: check return value of system command 2019-08-19 14:37:13 +10:00
AP_HAL_SITL AP_HAL_SITL: Scheduler skip set stack on Cygwin 2019-08-20 15:59:32 -07:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav AP_InertialNav: Remove unneeded methods 2019-07-16 12:11:42 +09:00
AP_InertialSensor AP_InertialSensor: fixed watchdog on AHRS trim gyro wait 2019-08-19 14:37:46 +10:00
AP_InternalError AP_InternalError: added error for i2c isr error 2019-08-25 17:12:16 +10:00
AP_IOMCU AP_IOMCU: use blocking writes to uart 2019-08-17 17:36:41 +10:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Fix includes 2019-04-05 20:12:53 +11:00
AP_L1_Control AP_L1_Control: use get_distance_NE instead of location_diff 2019-04-08 08:00:52 -07:00
AP_Landing AP_Landing: correct format string 2019-08-16 13:47:39 +10:00
AP_LandingGear AP_LandingGear: minor format fix 2019-05-11 08:49:40 +09:00
AP_LeakDetector AP_LeakDetector: add missing override keywords 2019-05-15 21:05:20 +10:00
AP_Logger AP_Logger: added logging of I2C ISR count 2019-08-26 09:13:39 +10:00
AP_Math AP_Math: add comment to vector2f::point_on_segment 2019-08-10 12:21:01 +09:00
AP_Menu
AP_Mission AP_Mission: Better AUTO watchdog restore 2019-08-25 06:40:34 -06:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: Tradheli - Make H3-120 swashplate the default 2019-08-06 08:24:59 +09:00
AP_Mount AP_Mount: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 2018-07-14 17:49:52 +10:00
AP_NavEKF2 AP_NavEKF2: don't fuse GPS when EK2_GPS_TYPE=3 2019-08-26 12:27:31 +10:00
AP_NavEKF3 AP_NavEKF3: shorten EKF3 initialisation send-text string 2019-08-05 19:50:32 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: new library for writing NMEA to serial ports 2019-05-21 09:41:15 +10:00
AP_Notify AP_Notify: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OSD AP_OSD: add primary airspeed item 2019-08-02 09:22:55 +09:00
AP_Parachute AP_Parachute: Added time check for sink rate to avoid glitches 2019-04-30 10:04:58 +10:00
AP_Param AP_Param: optionally return parameter flags in AP_Param::find(...) 2019-08-22 09:23:56 +10:00
AP_Proximity AP_Proximity: Add license info in Airsim lidar backend 2019-08-15 20:03:31 +10:00
AP_Radio AP_Radio: add missing override keywords 2019-08-19 14:36:16 +10:00
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RangeFinder RangeFinder: Change to coding style (NFC) 2019-08-23 10:11:30 +09:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: IBUS remove unused field 2019-07-22 09:12:57 +09:00
AP_Relay AP_Relay: add AP::relay() to get relay singleton 2019-07-03 23:59:24 -07:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_ROMFS AP_ROMFS: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_RPM AP_RPM: Added Arduino RPM Sensor Debug Tool 2019-08-20 09:13:09 +10:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: add clarifying comment on get_time_utc 2019-08-21 09:38:41 +10:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: log I2C ISR count 2019-08-26 09:13:39 +10:00
AP_Scripting AP_Scripting: Remove unneeded function, add some more enums 2019-08-17 10:41:27 +09:00
AP_SerialManager AP_SerialManager: added uartH support 2019-07-12 17:01:21 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: rangefinder no longer takes SerialManager in constructor 2019-07-16 09:29:48 +10:00
AP_Soaring AP_Soaring: move include of logger to .cpp file 2019-07-09 10:57:20 +10:00
AP_SpdHgtControl AP_SpdHgtControl: remove unused includes 2019-07-09 10:57:20 +10:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: prevent rapid changing of pitch limits on landing approach 2019-08-01 11:28:22 +10:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 2018-05-17 15:37:14 +10:00
AP_Terrain AP_Terrain: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_ToshibaCAN AP_ToshibaCAN: constify some local variables 2019-08-14 13:29:14 +09:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: add missing override keywords 2019-08-14 16:33:29 +10:00
AP_Vehicle AP_Vehicle: added iofirmware vehicle type 2019-03-15 14:38:57 +11:00
AP_VisualOdom AP_VisualOdom: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_Winch AP_Winch: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_WindVane AP_Windvane: fix NMEA vehicle to earth frame 2019-06-08 09:48:03 +09:00
APM_Control AR_AttitudeControl: minor comment fixes 2019-08-06 20:00:05 +09:00
AR_WPNav AR_WPNav: add oa_wp_bearing_cd function 2019-08-24 09:05:29 +09:00
doc
Filter Filter: Allow all filter frequencies to be 16bit. 2019-06-06 17:09:17 +10:00
GCS_MAVLink GCS_MAVLink: break out of loop statement once we have a result 2019-08-24 15:33:50 +10:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: unify debounce code 2019-08-02 12:34:02 +01:00
SITL SITL: sailboat motor enabled only for sailboat-motor frame 2019-08-21 19:34:13 +09:00
SRV_Channel SRV_Channel: allow DO_SET_SERVO commands while rc pass-thru 2019-06-13 09:51:21 +09:00
StorageManager StorageManager: allow for 15k storage 2018-06-24 08:26:28 +10:00