ardupilot/libraries
Peter Barker ebbcd00873 GCS_MAVLink: send statustext to all GCSs until update_send is called
until update_send it called we don't mark channels as streaming, so
send_statustext won't send to that channel.

Calculating the streaming mask could have been done as part of the init
call, but this fix may allow for information getting to the user in the
case that the streaming parameters are all zero, too.
2019-12-18 14:36:58 +11:00
..
AC_AttitudeControl AC_AttitudeControl: simplify body-frame roll axis swapping 2019-12-18 08:33:29 +11:00
AC_Autorotation AC_Autorotation: Created autorotation library 2019-11-29 08:06:10 +08:00
AC_AutoTune AC_AutoTune: Add check for reverse response abort. 2019-12-16 15:06:24 +09:00
AC_Avoidance AC_Avoid: adjust for proximity status namespace change 2019-10-31 11:58:15 +08:00
AC_Fence AC_Fence: turn off debug msg re memory allocation 2019-12-10 08:51:19 +11:00
AC_InputManager AC_InputManager: Change STAB_COL params to percent 2019-12-14 09:00:31 +09:00
AC_PID AC_PID: added AC_PI controller 2019-11-02 16:31:04 +11:00
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_Sprayer AC_Sprayer: use enum-class for SRV_CHANNEL_LIMIT_TRIM and friends 2019-11-26 10:17:17 +11:00
AC_WPNav AC_WPNav: add get_terrain_source and rename existing method 2019-12-17 20:02:01 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: added handle_adsb_vehicle() API 2019-10-16 13:13:24 +11:00
AP_AdvancedFailsafe AP_AdvancedFailSafe: add singleton getter 2019-09-17 09:13:43 +10:00
AP_AHRS AP_AHRS: NavEKF constructors no longer take rangefinder 2019-12-11 08:09:01 +11:00
AP_Airspeed AP_Airspeed: switched to recursive semaphore 2019-11-10 18:50:08 +11:00
AP_Arming AP_Arming: tpyo fix in parameter documentation 2019-12-05 12:17:06 +08:00
AP_Avoidance AP_Avoidance: reorder avoiding and sending GCS notification 2019-11-12 13:48:09 +11:00
AP_Baro AP_Baro: add driver for the SPL06-001 2019-11-24 16:47:31 -08:00
AP_BattMonitor AP_BattMonitor: support selective enable of SMBUS and fuel battery monitors 2019-12-09 21:35:00 +11:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BLHeli AP_BLHeli: log motor temp as zero 2019-11-26 11:56:33 +11:00
AP_BoardConfig AP_Boardconfig: Update BRD_SAFETY_MASK to refer to outputs not RC channels 2019-12-07 10:08:59 +11:00
AP_Button AP_Button: make singleton 2019-12-10 09:29:52 +09:00
AP_Camera AP_Camera: use corrected version of send_to_components 2019-11-26 12:10:12 +11:00
AP_Common AP_Common: remove is-zero checks for Location::offset 2019-11-19 10:49:19 +11:00
AP_Compass AP_Compass: tidy constructor 2019-12-05 17:38:57 +11: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_EFI AP_EFI: Add AP_EFI Library 2019-11-17 20:10:54 +11:00
AP_Filesystem AP_FileSystem: avoid aliasing isatty from unistd.h 2019-12-10 10:48:08 +11:00
AP_FlashStorage AP_FlashStorage: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00
AP_Follow AP_Follow: add clear_offsets_if_required method 2019-10-07 08:30:45 +09:00
AP_Frsky_Telem Ap_Frsky_Telem: replaced the passthrough scheduler with a WFQ one. 2019-10-29 10:27:17 +11:00
AP_GPS AP_GPS: cope with UAVCAN GPS that don't provide Aux message 2019-12-05 15:48:51 -07:00
AP_Gripper AP_Gripper: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00
AP_HAL AP_HAL: update docs for ObjectBuffer 2019-12-10 21:07:58 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: fixed build of SPI clock test 2019-12-13 09:30:48 +11:00
AP_HAL_Empty AP_HAL_Empty: Remove set_stop_pin from AnalogSource 2019-09-04 09:54:50 +10:00
AP_HAL_Linux HAL_Linux: disable input modifications on serial interface for rc receiver 2019-11-13 09:02:30 -08:00
AP_HAL_SITL AP_HAL_SITL: set cloexec on eeprom.bin 2019-12-02 19:06:34 +11:00
AP_ICEngine AP_ICEngine: added ICE_OPTIONS 2019-12-18 12:28:41 +11:00
AP_InertialNav AP_InertialNav: use ekf::get_vert_pos_rate during high vibration 2019-10-18 11:15:25 +09:00
AP_InertialSensor AP_InertialSensor: add rpm-based motor noise to gyros and accels 2019-12-17 10:07:06 +11:00
AP_InternalError AP_InternalError: added hex and decimal comments 2019-12-09 12:43:39 +11:00
AP_IOMCU AP_IOMCU: Ensure IOMCU does not log if there is no logger 2019-11-20 11:46:34 +11: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: log motor temp as zero 2019-11-26 11:56:33 +11:00
AP_L1_Control AP_L1_Control: wrap_180_cd no longer solely returns floats 2019-09-18 12:57:02 +10:00
AP_Landing AP_Landing: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_LandingGear AP_Landing: emit DEPLOY gcs text only if not already deployed 2019-12-02 07:28:53 +08:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: add error code for rtl missing rangefinder 2019-12-17 20:02:01 +09:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: added smaller footprint crc32 2019-10-28 15:53:16 +11:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: add string for DO_MOUNT_CONTROL 2019-12-10 14:00:30 +11:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: add copter tailsitter differential torque frames 2019-12-18 08:33:29 +11:00
AP_Mount AP_Mount: change type of roi_target_set to boolean 2019-11-12 07:52:22 +08:00
AP_NavEKF AP_NavEKF: use instance # when logging EKF core timings 2019-12-06 12:52:03 +09:00
AP_NavEKF2 AP_NavEKF2: use instance number when logging rather than multiple message IDs 2019-12-17 12:22:07 +11:00
AP_NavEKF3 AP_NavEKF3: use instance number when logging rather than multiple message IDs 2019-12-17 12:22:07 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: NavEKF constructors no longer take rangefinder 2019-12-11 08:09:01 +11:00
AP_Notify AP_Notify: add handle rgb 2019-12-12 21:35:23 -07:00
AP_OpticalFlow AP_OpticalFlow: NavEKF constructors no longer take rangefinder 2019-12-11 08:09:01 +11:00
AP_OSD AP_OSD: fixes for modified AP_ROMFS API 2019-10-24 22:03:43 +11:00
AP_Parachute AP_Parachute: cope with change in namespace of LogEvent enum 2019-11-05 08:19:26 +08:00
AP_Param AP_Param: rename sensor_config_error to config_error 2019-11-08 10:14:34 +11:00
AP_Proximity AP_Proximity: remove unused include from AP_Proximity_MAV 2019-12-09 11:25:02 +09:00
AP_Radio AP_Radio: expect delay whil resetting radios 2019-11-27 22:35:15 +11: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 AP_RangeFinder: remove param conversion for 3rd and 4th 2019-12-03 13:06:10 +08:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: remove duplicated definition from protocol_detected 2019-10-31 08:24:30 +11:00
AP_Relay AP_Relay: change parameter name from relay to instance 2019-09-27 12:02:38 +10:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_ROMFS AP_ROMFS: fixed return size for uncompressed ROMFS 2019-10-25 21:36:55 +11:00
AP_RPM AP_RPM: use updated rpm information for sitl 2019-12-17 10:07:06 +11:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: add local time support 2019-10-07 19:55:42 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: use fill_nanf() on each scheduler function 2019-10-01 17:35:26 +10:00
AP_Scripting AP_Scripting: add rgb notify led example 2019-12-12 21:35:23 -07:00
AP_SerialLED AP_SerialLED: check for valid channel 2019-11-04 13:06:08 +11:00
AP_SerialManager AP_SerialManager: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: NavEKF constructors no longer take rangefinder 2019-12-11 08:09:01 +11: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: added semaphore to flttime update 2019-12-03 21:04:48 +11:00
AP_TECS AP_TECS: removed TECS_LAND_PMIN 2019-11-19 07:50:40 +11:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: Update TSYS01 for Pixhawk2 2019-09-27 13:08:26 -07:00
AP_Terrain AP_Terrain: leave ENABLE as 1 if memory alloc fails 2019-11-19 10:16:25 +11:00
AP_ToshibaCAN AP_ToshibaCAN: consume and log motor temperature 2019-11-26 11:56:33 +11:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: support RTCMStream for RTCM injection 2019-11-09 17:11:32 +11:00
AP_Vehicle AP_Vehicle: stop passing rangefinder in constructors of NavEKF objects 2019-12-11 08:09:01 +11:00
AP_VisualOdom AP_VisualOdom: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: add SITL backend 2019-10-07 07:31:51 +11:00
AP_Winch AP_Winch: use enum-class for SRV_CHANNEL_LIMIT_TRIM and friends 2019-11-26 10:17:17 +11:00
AP_WindVane AP_WindVane: use strtof instead of atof 2019-10-28 15:53:16 +11:00
APM_Control APM_Control: AR_AttitudeControl: add description for new PID params 2019-09-23 09:45:46 +09:00
AR_WPNav AR_WPNav: remove unneeded overshoot methods 2019-10-23 08:28:39 +08:00
doc
Filter Filter: switch harmomic notch mode to enum class 2019-11-19 07:08:01 +08:00
GCS_MAVLink GCS_MAVLink: send statustext to all GCSs until update_send is called 2019-12-18 14:36:58 +11:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: added LOITER switch for plane 2019-12-17 16:14:53 +11:00
SITL SITL: fixed airsim example scripts 2019-12-17 15:40:00 +11:00
SRV_Channel SRV_Channel: use enum-class for SRV_CHANNEL_LIMIT_TRIM and friends 2019-11-26 10:17:17 +11:00
StorageManager StorageManager: use https:// scheme for ardupilot URLs 2019-12-10 07:53:46 +11:00