ardupilot/libraries
Peter Barker 9f0e191505 GCS_MAVLink: deny attempt to do partial upload while mission transfer in progress
fixes an internal error where we make sure resources are not allocated before allocating upload resources.

The user may receive a DENIED message if they move a waypoint before an item has been transfered to the vehicle.
2024-05-15 12:26:34 +10:00
..
AC_AttitudeControl AC_AttitudeControl: move euler_rate_to_ang_vel, ang_vel_to_euler_rate and euler_accel_limit to Quaternion attitude 2024-05-07 08:34:40 +09:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: zero out D_FF during twitching 2024-05-14 16:33:38 +09:00
AC_Avoidance AC_Avoid: add "BACKZ_SPD" vertical backup speed limit parameter 2024-05-01 17:25:07 +10: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: allow for fence storage on microSD 2024-03-12 11:43:36 +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: reduce code duplication, move common functionally to the base class 2024-03-20 19:33:14 +11:00
AC_Sprayer AC_Sprayer: Fix some typos 2023-10-12 18:30:42 +11:00
AC_WPNav AC_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
AP_AccelCal AP_AccelCal: remove pointless assignment when counting calibrators 2024-01-21 09:53:04 +11:00
AP_ADC
AP_ADSB AP_ADSB: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: make GCS failsafe timeout a parameter 2023-09-13 18:06:28 +10:00
AP_AHRS AP_AHRS: added get_air_density_ratio() 2024-05-07 21:19:06 +10:00
AP_Airspeed AP_Airspeed: added atmospheric tables for high altitude flight 2024-05-07 21:19:06 +10:00
AP_AIS AP_AIS: correct compilation when HAL_LOGGING_ENABLED is false 2024-01-17 18:25:55 +11:00
AP_Arming AP_Arming: exclude body of AP_Arming.cpp based on AP_ARMING_ENABLED 2024-04-17 18:17:27 +10:00
AP_Avoidance AP_Avoidance: correct compilation when HAL_GCS_ENABLED is false 2023-12-12 11:41:47 +11:00
AP_Baro AP_Baro: create explicit define for BARO_PROBE_EXT parameter 2024-05-08 18:18:07 +10:00
AP_BattMonitor AP_BattMonitor: ESC: add mask 2024-05-14 09:58:04 +10:00
AP_Beacon AP_Beacon: rename GPS_ to GPS1_ 2024-03-19 19:50:12 +11:00
AP_BLHeli AP_BLHeli: fixed define for BLHeli support 2024-03-18 14:12:25 +11:00
AP_BoardConfig AP_BoardConfig: move handling of AP_Radio RC input down into AP_RCProtocol 2024-05-01 17:51:49 +10:00
AP_Button
AP_Camera AP_Camera: correct compilation when HAL_MOUNT_SET_CAMERA_SOURCE_ENABLED not set 2024-04-14 13:33:00 +10:00
AP_CANManager AP_CANManager: CANSensor: add getter for initialized 2024-05-07 09:48:10 +10: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 get_distance_NED_alt_frame method 2024-04-30 08:03:39 +09:00
AP_Compass AP_Compass: workaround hardware bug in IST8310 whoami 2024-05-01 09:24:54 +10:00
AP_CSVReader
AP_CustomRotations AP_CustomRotations: add and use AP_CUSTOMROTATIONS_ENABLED 2024-03-03 08:22:46 +11:00
AP_DAL AP_DAL: use ahrs for EAS2TAS 2024-05-07 21:19:06 +10:00
AP_DDS AP_DDS: Fix incorrect port param name 2024-03-24 11:27:22 +11:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: call RPM subscribe 2024-05-02 20:25:38 +10:00
AP_EFI AP_EFI: add missing include 2024-01-11 15:29:54 +11:00
AP_ESC_Telem AP_ESC_TELEM: solved the logical error in grouping of escs into 4 2024-04-24 08:10:02 +09:00
AP_ExternalAHRS AP_ExternalAHRS: Fix duplicate condition 2024-05-14 09:58:59 +10:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: remove references to legacy UART order 2023-12-19 06:53:15 +11:00
AP_Filesystem AP_Filesystem: guarantee load_file() data is null-terminated 2024-05-04 10:15:44 +10:00
AP_FlashIface AP_FlashIface: Fix some typos 2023-10-12 18:30:42 +11:00
AP_FlashStorage AP_FlashStorage: Fix some typos 2023-10-12 18:30:42 +11:00
AP_Follow AP_Follow: use Location.change_alt_frame for what it is good for 2024-04-14 13:29:58 +10:00
AP_Frsky_Telem AP_Frsky_Telem: avoid manipulation of alt frames outside of Location object 2024-04-16 19:14:12 +10:00
AP_Generator AP_Gernerator: IE 2400: MAV_SEVERITY level depends on error code 2024-03-12 11:05:21 +11:00
AP_GPS AP_GPS: fix GPS headings 2024-05-12 21:06:52 +10:00
AP_Gripper AP_Gripper: move gripper up to AP_Vehicle 2024-02-21 21:05:12 +11:00
AP_GyroFFT AP_GyroFFT: correct compilation when AP_Arming is not compiled in 2024-03-19 07:29:17 +11:00
AP_HAL AP_HAL: move handling of AP_Radio RC input down into AP_RCProtocol 2024-05-01 17:51:49 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add SDMODELV2 2024-05-15 07:27:46 +10:00
AP_HAL_Empty AP_HAL_Empty: update uart_info function for new signature 2024-04-03 13:10:06 +01:00
AP_HAL_ESP32 AP_HAL_ESP32: Added missing letter to printf statement 2024-04-03 16:18:02 +09:00
AP_HAL_Linux AP_HAL_Linux: Remove message about base address 2024-05-13 10:46:58 -03:00
AP_HAL_SITL HAL_SITL: use baro atmospheric tables 2024-05-07 21:19:06 +10: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_InertialNav AP_InertialNav: freeze horiz_vel when !velned_ok 2023-12-05 10:44:37 +11:00
AP_InertialSensor AP_InertialSensor: ensure that notches get updated while converging 2024-05-03 07:34:21 +10:00
AP_InternalError
AP_IOMCU AP_IOMCU: allow up to 16 channels of servo data to be sent to the iomcu 2024-05-01 08:21:01 +10:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: Ensure all printf() calls end with line break 2024-05-07 14:39:19 +10:00
AP_KDECAN
AP_L1_Control AP_L1_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Landing AP_Landing: restart_landing_sequence get current location and pass it to get_landing_sequence_start 2024-04-02 11:11:59 +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: rename class and hwdef related to w25nxx 2024-05-06 12:26:38 +10:00
AP_LTM_Telem AP_LTM_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_Math AP_Math: Add RDS02UF RangeFinder CRC 2024-04-01 16:12:53 +11:00
AP_Menu
AP_Mission AP_Mission: emit jump count even if no limit 2024-05-08 17:56:56 +10:00
AP_Module AP_Module: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Motors AP_MotorsHeli: Swash: Make motor numbers const 2024-05-09 15:19:44 -04:00
AP_Mount AP_Mount: Do not override default mode when first connecting to RC 2024-04-12 12:18:33 +09:00
AP_MSP AP_MSP: Use scaled RC inputs instead of direct RC in. Also flip pitch to be correct. 2024-03-08 06:54:17 +11:00
AP_NavEKF AP_NavEKF: correct setting of _filled 2024-04-10 21:53:54 +10:00
AP_NavEKF2 AP_NavEKF2: use set_and_defualt when changing imu mask 2024-03-26 11:35:36 +11:00
AP_NavEKF3 AP_NavEKF3: Change yaw source to stop compass use when calibrating 2024-04-23 15:19:56 +09:00
AP_Navigation
AP_Networking AP_Networking: change NET_ENABLED to NET_ENABLE 2024-03-20 19:08:31 +11:00
AP_NMEA_Output AP_NMEA_Output: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Notify AP_Notify: remove VRBrain board sub-types 2024-03-26 11:06:13 +11:00
AP_OLC AP_OLC: add unit tests 2023-10-04 19:00:34 +11:00
AP_ONVIF
AP_OpenDroneID AP_OpenDroneID: fix comment typo 2023-10-31 10:37:45 +11:00
AP_OpticalFlow AP_OpticalFlow: correct comments on AP_OpticalFlow methods 2024-01-22 19:14:42 +11:00
AP_OSD AP_OSD: add extended RC link stats OSD fields 2024-04-02 10:30:24 +11:00
AP_Parachute AP_Parachute: optional (CHUTE_OPTIONS:1) disarm defore parachute release 2024-04-10 21:55:51 +10:00
AP_Param AP_Param: add convert_bitmask_parameter_width method 2024-04-17 22:15:22 +01:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: add RPLidarC1 support 2024-03-20 18:58:57 +11:00
AP_Radio AP_Radio: move handling of AP_Radio RC input down into AP_RCProtocol 2024-05-01 17:51:49 +10:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: fix Lua timeout 2024-05-14 09:26:25 +10:00
AP_RCMapper AP_RCMapper: exclude body of AP_RCMapper based on AP_RCMAPPER_ENABLED 2024-04-17 18:17:56 +10:00
AP_RCProtocol AP_RCProtocol: move handling of AP_Radio RC input down into AP_RCProtocol 2024-05-01 17:51:49 +10:00
AP_RCTelemetry AP_RCTelemetry: add extended RC link stats OSD fields 2024-04-02 10:30:24 +11:00
AP_Relay AP_Relay: added relay output invert function 2024-04-06 10:58:43 +11:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: add DroneCAN backend 2024-05-02 20:25:38 +10:00
AP_RSSI AP_RSSI: add and use AP_RSSI_ENABLED 2023-12-12 11:37:57 +11:00
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_SBusOut AP_SBusOut: make sbus output exactly match sbus input decoding 2023-10-13 09:42:25 +11:00
AP_Scheduler AP_Scheduler: fixes for AP_SCHEDULER_ENABLED 2024-04-18 08:25:15 +10:00
AP_Scripting AP_Scripting: fixed float register save/restore in setjmp/longjmp 2024-05-15 06:47:44 +10:00
AP_SerialLED AP_SerialLED: return success status from send and set_RGB 2023-11-20 19:22:20 +11:00
AP_SerialManager AP_SerialManager: move serial_manager parameters up to base class 2024-02-29 12:12:19 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: allow mavlink command of rcin scaled functions 2023-10-17 10:32:39 +11:00
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: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_TECS AP_TECS: fixed adjusting speed without airspeed sensor 2024-03-03 20:28:38 +11:00
AP_TempCalibration AP_TempCalibration: add and use AP_TEMPCALIBRATION_ENABLED 2023-11-07 07:46:24 +11:00
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: multi backend support 2024-05-08 17:51:09 +10:00
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: cope with AP_Scheduler not being available 2024-04-18 08:25:15 +10:00
AP_VideoTX AP_VideoTX:add additional freq bands(Band X) 2024-03-19 07:30:49 +11:00
AP_VisualOdom AP_VisualOdom: correct unused variable in visualodom 2024-04-10 21:52:28 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: correct compilation when HAL_GCS_ENABLED is false 2024-03-08 10:04:53 +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
APM_Control APM_Control: move AC_Avoidance defines into libraries 2024-03-11 18:07:18 +11:00
AR_Motors AP_MotorsUGV: Fix Riscv64 compiler error issue #25974 2024-01-23 08:34:33 +09:00
AR_WPNav AR_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
Filter Filter: Get common processes out of the way 2024-05-08 17:41:32 +10:00
GCS_MAVLink GCS_MAVLink: deny attempt to do partial upload while mission transfer in progress 2024-05-15 12:26:34 +10:00
PID
RC_Channel RC_Channel: process only transitions after rc is valid for arm_emergency_stop switch and parachute deploy switch 2024-04-11 22:17:08 +10:00
SITL SITL: fix GPS headings 2024-05-12 21:06:52 +10:00
SRV_Channel SRV_Channels: gate method on scripting being enabled 2024-04-18 08:25:15 +10:00
StorageManager
COLCON_IGNORE