ardupilot/libraries
Peter Barker 33a319aaf3 GCS_MAVLink: do not run all commands received on private channel
Co-authored-by: dawid.kopec.spectalight@gmail.com

returning true from this function means that we should run the command locally.  We really don't want to do that unless the command (or other targetted message) was actually sent at us!
2022-11-29 10:32:02 +11:00
..
AC_AttitudeControl AC_AttitudeControl: generalize pid descriptions 2022-11-22 10:55:45 +11:00
AC_AutoTune AC_AutoTune: fix pilot testing bug 2022-11-22 08:10:00 +09:00
AC_Autorotation AC_Autorotation: add and use AP_RPM_ENABLED 2022-09-20 09:28:27 +10:00
AC_Avoidance AC_Avoidance: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AC_CustomControl AC_CustomControl: generalize pid descriptions 2022-11-22 10:55:45 +11:00
AC_Fence all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_InputManager all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AC_PID AC_PID: params always use set method 2022-08-03 13:43:48 +01:00
AC_PrecLand AC_PrecLand: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AC_Sprayer AC_Sprayer: rename the boolean passed to run method 2022-11-17 13:46:46 +09:00
AC_WPNav AC_WPNav: AC_Loiter: Fix loiter level bug 2022-09-02 09:02:46 +09:00
APM_Control APM_Control: generalize pid descriptions 2022-11-22 10:55:45 +11:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_AHRS AP_AHRS: use Vector3f.xy() to avoid creating a fresh Vector2f 2022-11-16 17:59:29 +11:00
AP_AIS AP_AIS: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_AccelCal AP_AccelCal: remove unneccesary includes of AP_Vehicle_Type.h 2022-11-02 18:35:48 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: include cleanups 2022-11-08 09:49:19 +11:00
AP_Airspeed AP_Airspeed: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Arming AP_Arming: update docs for new THR_MIN behaviour on plane 2022-11-14 11:14:09 +11:00
AP_Avoidance AP_Avoidance: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_BLHeli AP_BLHeli: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Baro AP_Baro: add missing includes 2022-11-15 16:44:38 +11:00
AP_BattMonitor AP_BattMonitor: add synthetic current sensor,fix SITL current 2022-11-24 06:53:35 +11:00
AP_Beacon AP_Beacon: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_BoardConfig AP_BoardConfig: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Button AP_Button: print button index and postion on aux function trigger 2022-10-14 12:01:07 +11:00
AP_CANManager AP_CANManager: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_Camera AP_Camera: retry RunCam device info maximum number of times 2022-11-22 10:54:56 +11:00
AP_CheckFirmware AP_CheckFirmware: remove GCS.h from header files 2022-11-16 18:29:07 +11:00
AP_Common AP_Common: use Vector3f.xy() to avoid creating a fresh Vector2f 2022-11-16 17:59:29 +11:00
AP_Compass AP_Compass: regularise compass defines 2022-11-15 16:44:38 +11:00
AP_CustomRotations
AP_DAL AP_DAL: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_Declination AP_Declination: avoid undefined floating point exceptions on macOS when using implicit casts 2022-08-24 17:34:17 +10:00
AP_Devo_Telem AP_Devo_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_EFI AP_EFI: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_ESC_Telem AP_ESC_Telem: allow external libraries, like AP_TemperatureSensor, to override the temperature 2022-10-18 10:05:31 +11:00
AP_ExternalAHRS AP_ExternalAHRS: regularise compass defines 2022-11-15 16:44:38 +11:00
AP_FETtecOneWire all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Filesystem AP_Filesystem: fixed builds for ESP32 2022-11-28 12:23:07 +11:00
AP_FlashIface AP_FlashIface: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_FlashStorage
AP_Follow AP_Follow: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_Frsky_Telem AP_Frsky_Telem: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_GPS AP_GPS: improve support for uBlox-M10 2022-11-22 19:51:01 +11:00
AP_Generator AP_Generator: remove GCS.h from header files 2022-11-16 18:29:07 +11:00
AP_Gripper AP_Gripper: set AP_GRIPPER_ENABLED in minimize_features.inc 2022-11-02 18:40:09 +11:00
AP_GyroFFT AP_GyroFFT: move definition of HAL_GYROFFT_ENABLED to AP_HAL_Boards.h 2022-11-05 14:52:10 +11:00
AP_HAL AP_HAL: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_HAL_ChibiOS hwdef: correct compilation of CubeOrange bdshot variants 2022-11-26 22:16:23 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: add esp32 build to CI 2022-11-28 20:32:22 +11:00
AP_HAL_Empty AP_HAL_Empty: move implementations of functions to header 2022-06-23 12:38:41 +10:00
AP_HAL_Linux AP_HAL_Linux: add LEAK probe pin to Navigator gpio whitelist 2022-11-08 09:46:50 -03:00
AP_HAL_SITL HAL_SITL: only do the cygwin speedup hack for scripting while armed 2022-11-10 12:12:03 +11:00
AP_Hott_Telem AP_Hott_Telem: move definition of HAL_HOTT_TELEM_ENABLED to minimise include file 2022-11-08 20:23:58 +11:00
AP_ICEngine AP_ICEngine: added allow_throttle_while_disarmed() 2022-11-14 11:14:09 +11:00
AP_IOMCU AP_IOMCU: log number of errors reading status page 2022-09-02 11:16:52 +10:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: various SITL INS improvements 2022-11-16 10:22:33 +11:00
AP_InternalError AP_InternalError: only panic in SITL if debug enabled 2022-10-21 22:14:39 +11:00
AP_JSButton
AP_KDECAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_L1_Control all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_LTM_Telem AP_LTM_Telem: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_Landing AP_Landing: Make flare extension aim point compensation tuneable 2022-11-18 05:43:59 +11:00
AP_LandingGear all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_LeakDetector AP_LeakDetector: add manual leak-pin selection 2022-11-12 20:38:35 -03:00
AP_Logger AP_Logger: on example sketches there is always time to write out FMT messages 2022-11-09 19:01:14 +11:00
AP_MSP AP_MSP: regularise compass defines 2022-11-15 16:44:38 +11:00
AP_Math AP_Math: remove normalization of random compass Vector3f 2022-11-17 15:13:34 +11:00
AP_Menu
AP_Mission AP_Mission: DO_LAND_START to consider altitude (3D distance) 2022-11-15 10:42:01 +11:00
AP_Module AP_Module: correct ModuleTest example for lack of GCS object 2022-08-19 18:34:19 +10:00
AP_Motors AP_Motors: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_Mount AP_Mount: gremsy driver sends vehicle att at 50hz 2022-11-10 10:34:05 +09:00
AP_NMEA_Output AP_NMEA_Output: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_NavEKF AP_NavEKF: add and use AP_BEACON_ENABLED 2022-11-16 08:16:31 +11:00
AP_NavEKF2 AP_NavEKF2: make rngBcnDataToFuse const false if beacon not compiled in 2022-11-16 08:16:31 +11:00
AP_NavEKF3 AP_NavEKF3: Prevent on ground range to ground being used in flight 2022-11-22 11:23:44 +11:00
AP_Navigation
AP_Notify AP_Notify: rename HAL_OREO_LED_ENABLED to AP_NOTIFY_OREOLED_ENABLED 2022-11-22 10:23:35 +11:00
AP_OLC AP_OLC: tidy includes 2022-05-03 09:14:58 +10:00
AP_ONVIF all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_OSD AP_OSD: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_OpenDroneID AP_OpenDroneID: include fixes 2022-11-16 18:29:07 +11:00
AP_OpticalFlow AP_OpticalFlow: include cleanups 2022-11-08 09:49:19 +11:00
AP_Parachute all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Param AP_Param: allow for removing parameters from lua scripts 2022-11-10 12:27:53 +11:00
AP_PiccoloCAN all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Proximity all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RAMTRON AP_RAMTRON: reduce scope for WITH_SEMAPHORE 2022-07-17 21:42:33 +10:00
AP_RCMapper all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RCProtocol AP_RCProtocol: allow FRSky to be compiled out 2022-11-15 18:44:45 +11:00
AP_RCTelemetry Add RC_OPTIONS feature gating of crsf flight mode star 2022-11-29 10:30:47 +11:00
AP_ROMFS AP_ROMFS: tidy includes 2022-05-03 09:14:58 +10:00
AP_RPM AP_RPM: fixed SITL RPM backend for new motor mask 2022-10-16 20:38:19 +11:00
AP_RSSI all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_RTC
AP_Radio AP_Radio: increase short board names to 23 chars 2022-09-21 17:56:42 +10:00
AP_Rally AP_Rally: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11:00
AP_RangeFinder AP_RangeFinder: remove GCS.h from library header files 2022-11-16 18:29:07 +11:00
AP_Relay AP_Relay: added get() method for scripting 2022-10-11 11:47:04 +11:00
AP_RobotisServo all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_SBusOut all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scheduler all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Scripting AP_Scripting: moved trick72.txt to Schedules/AirShow.txt 2022-11-28 10:40:50 +11:00
AP_SerialLED AP_SerialLED: enable 32 servo outs 2022-05-22 12:07:37 +10:00
AP_SerialManager AP_SerialManager: move multiple RC input error to pre-arm failure 2022-10-25 11:34:13 +11:00
AP_ServoRelayEvents all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_SmartRTL AP_SmartRTL: params always use set method 2022-08-03 13:43:48 +01:00
AP_Soaring AP_Soaring: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
AP_Stats
AP_TECS AP_TECS: Fix TECS_OPTIONS documentation 2022-11-18 05:43:59 +11:00
AP_TempCalibration all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_TemperatureSensor AP_TemperatureSensor: use AP_Enum<>, add sitl, add _config.h 2022-10-18 10:05:31 +11:00
AP_Terrain AP_Terrain: include required AP_Vehicle_Type header 2022-11-02 18:35:48 +11: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: update options bitmask for PWM option 2022-11-23 19:47:50 +11:00
AP_Vehicle AP_Vehicle: Add pitch_trim_cd to fixed wing shared parameters 2022-11-18 05:43:59 +11:00
AP_VideoTX AP_VideoTX: tidy AP_SerialManager.h includes 2022-11-08 09:49:19 +11:00
AP_VisualOdom AP_VisualOdom: include cleanups 2022-11-08 09:49:19 +11:00
AP_Volz_Protocol AP_Volz: disable with minmimize features 2022-06-15 18:05:44 +10:00
AP_WheelEncoder all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_Winch all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AP_WindVane all: use CLASS_NO_COPY() macro 2022-10-04 11:23:04 +11:00
AR_Motors AR_Motors: remove arming check to allow ackerman and skid-steering 2022-08-22 07:46:50 -04:00
AR_WPNav AR_WPNav: add accessors for accel and jerk limits 2022-09-06 11:23:51 +09:00
Filter Filter: allow for expansion of dynamic filters 2022-10-16 20:38:19 +11:00
GCS_MAVLink GCS_MAVLink: do not run all commands received on private channel 2022-11-29 10:32:02 +11:00
PID PID: params always use set method 2022-08-03 13:43:48 +01:00
RC_Channel Add RC_OPTIONS feature gating of crsf flight mode star 2022-11-29 10:30:47 +11:00
SITL SITL: vicon odometry corrected 2022-11-28 17:21:23 +11:00
SRV_Channel SRV_Channel: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
StorageManager StorageManager: change namespace of MultiCopter and FixedWing params 2022-11-09 19:04:37 +11:00
doc