ardupilot/libraries
Shiv Tyagi 8bd26dffac AC_PrecLand: rotate target vector based on sensor orient
Since, the frontend takes care of rotating sensor frame target vector to body frame, the  sitl backend should return unit
vector in sensor frame instead of body frame. This is to have homogeneity among backends.
2022-08-30 03:44:26 -04:00
..
AC_AttitudeControl AC_AttitudeControl: removed use of "blended" earth frame accel 2022-08-21 18:51:59 +10:00
AC_AutoTune AC_AutoTune: params always use set method 2022-08-03 13:43:48 +01:00
AC_Autorotation AC_Autorotation: params always use set method 2022-08-03 13:43:48 +01:00
AC_Avoidance AC_Avoidance: params always use set method 2022-08-03 13:43:48 +01:00
AC_CustomControl AC_CustomControl: add README 2022-08-30 13:10:09 +10:00
AC_Fence AC_Fence: always declare AC_PolyFenceItem 2022-08-30 09:07:27 +10:00
AC_InputManager AC_InputManager: params always use set method 2022-08-03 13:43:48 +01:00
AC_PID AC_PID: params always use set method 2022-08-03 13:43:48 +01:00
AC_PrecLand AC_PrecLand: rotate target vector based on sensor orient 2022-08-30 03:44:26 -04:00
AC_Sprayer
AC_WPNav AC_WPNav: correct metadata in libraries failing checks on emitter 2022-08-16 11:50:11 +10:00
APM_Control APM_Control: removed use of "blended" earth frame accel 2022-08-21 18:51:59 +10:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: correct metadata in libraries failing checks on emitter 2022-08-16 11:50:11 +10:00
AP_AHRS AP_AHRS: removed use of "blended" accel values 2022-08-21 18:51:59 +10:00
AP_AIS AP_AIS: include GCS_MAVLink.h 2022-07-13 18:32:35 +10:00
AP_AccelCal AP_AccelCal: limit COMMAND_ACKs accepted for vehicle pose confirmation 2022-05-25 17:55:55 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: add note to desc's on how to determine GPIO pin numbers 2022-04-24 08:21:01 +09:00
AP_Airspeed AP_Airspeed: correct metadata in libraries failing checks on emitter 2022-08-16 11:50:11 +10:00
AP_Arming AP_Arming: shift pre-arm check to AP_Proximity 2022-08-24 18:26:27 +10:00
AP_Avoidance AP_Avoidance: params always use set method 2022-08-03 13:43:48 +01:00
AP_BLHeli AP_BLHeli: make ESC debug easier to see 2022-08-03 17:06:38 +10:00
AP_Baro AP_Baro: params always use set method 2022-08-03 13:43:48 +01:00
AP_BattMonitor AP_BattMonitor: move read_block up to SMBus base class 2022-08-30 09:09:54 +10:00
AP_Beacon AP_Beacon: params always use set method 2022-08-03 13:43:48 +01:00
AP_BoardConfig AP_BoardConfig: params always use set method 2022-08-03 13:43:48 +01:00
AP_Button AP_Button: pre-arm displays gpio vs servo_ch conflict 2022-04-26 15:19:28 +09:00
AP_CANManager AP_CANManager: added scripting2 protocol 2022-07-03 08:21:55 +10:00
AP_Camera AP_Camera: params always use set method 2022-08-03 13:43:48 +01:00
AP_CheckFirmware AP_CheckFirmware: added monocypher 2022-08-30 10:51:06 +10:00
AP_Common AP_Common: correct gtests 2022-08-15 07:39:39 +10:00
AP_Compass AP_Compass: params always use set method 2022-08-03 13:43:48 +01:00
AP_CustomRotations AP_CustomRotations: fix param refrencing 2022-04-20 18:25:57 +10:00
AP_DAL AP_DAL: added set source events for EKF3 2022-05-31 09:17:37 +10: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_EFI AP_EFI: prevent flood of Lutan serial port 2022-08-03 08:27:12 +10:00
AP_ESC_Telem AP_ESC_Telem: don't provide zero udpates for ESCs that have never been used 2022-08-30 10:03:31 +10:00
AP_ExternalAHRS AP_ExternalAHRS: stop using GCS_MAVLINK.h in header files 2022-08-16 09:45:51 +10:00
AP_FETtecOneWire AP_FETTecOneWire: Fix the recent change of NUM_SERVO_CHANNELS > 24 2022-06-22 11:51:23 +10:00
AP_Filesystem AP_Filesystem: rename HAL_MISSION_ENABLED to AP_MISSION_ENABLED 2022-08-18 22:49:10 +10:00
AP_FlashIface AP_FlashIface: fix examples 2022-08-19 18:33:58 +10:00
AP_FlashStorage
AP_Follow AP_Follow: vector params always use set method 2022-08-03 13:43:48 +01:00
AP_Frsky_Telem AP_Frsky_Telem: change AC_FENCE to AP_FENCE_ENABLED 2022-07-27 19:04:56 +10:00
AP_GPS AP_GPS: fixed handling of DroneCAN GPS without vertical velocity 2022-08-23 11:17:06 +10:00
AP_Generator AP_Generator: add AP_GENERATOR_RICHENPOWER_ENABLED 2022-07-19 09:09:05 +10:00
AP_Gripper AP_Gripper: apply auto close to all backends. 2022-08-09 13:23:35 +10:00
AP_GyroFFT AP_GyroFFT: params always use set method 2022-08-03 13:43:48 +01:00
AP_HAL AP_HAL: set default HAL_ENABLE_DFU_BOOT 2022-08-30 10:51:06 +10:00
AP_HAL_ChibiOS hwdef: enable DFU on some boards 2022-08-30 10:51:06 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10: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: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_HAL_SITL AP_HAL_SITL: correct bind-value SIM_RC_FAIL handling 2022-08-10 17:14:21 +10:00
AP_Hott_Telem AP_Hott_Telem: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ICEngine AP_ICEngine: add and use AP_ICENGINE_ENABLE 2022-07-22 08:48:16 +10:00
AP_IOMCU AP_IOMCU: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: correct INS_generic example 2022-08-13 20:53:29 +10:00
AP_InternalError
AP_JSButton
AP_KDECAN AP_KDECAN: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_L1_Control AP_L1_Control: use AP_GROUPINFO instead of AP_GROUPINFO_FRAME 2022-05-10 09:35:11 +10:00
AP_LTM_Telem AP_LTM_Telem: add AP_LTM_TELEM_ENABLED 2022-06-28 20:19:41 +10:00
AP_Landing AP_Landing: change logging to be designated as streaming 2022-08-05 10:16:18 +10:00
AP_LandingGear AP_LandingGear: SITL: only set defualts is SITL pin is set avoiding enable via param conversion 2022-08-02 10:48:19 +10:00
AP_LeakDetector
AP_Logger AP_Logger: MessageWriter: convert enums to enum class's 2022-08-30 09:07:27 +10:00
AP_MSP AP_MSP: rename OpticalFlow class to AP_OpticalFlow 2022-08-18 14:24:01 +10:00
AP_Math AP_Math: add dignostic message for SCurve internal error 2022-08-10 22:18:42 +10:00
AP_Menu
AP_Mission AP_Mission: add AP_Mission_config.h 2022-08-18 22:49:10 +10: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: refactor to allow frame type symbols to be created for ELF 2022-08-09 10:06:18 +10:00
AP_Mount AP_Mount: allow users to disable yaw on 3-axis gimbals 2022-08-30 10:05:09 +10:00
AP_NMEA_Output
AP_NavEKF AP_NavEKF: added a getter function for active source set 2022-08-18 02:05:27 -04:00
AP_NavEKF2 AP_NavEKF2: stop using GCS_MAVLINK.h in header files 2022-08-16 09:45:51 +10:00
AP_NavEKF3 AP_NavEKF3: store and use lastKnownPositionD 2022-08-22 19:48:03 +10:00
AP_Navigation
AP_Notify AP_Notify: tidy includes 2022-05-03 09:14:58 +10:00
AP_OLC AP_OLC: tidy includes 2022-05-03 09:14:58 +10:00
AP_ONVIF AP_ONVIF: fix executable permission and trailing whitespace 2022-06-08 08:16:42 +09:00
AP_OSD AP_OSD: add required include 2022-08-16 09:45:51 +10:00
AP_OpenDroneID AP_OpenDroneID: fixed cpp check for cygwin 2022-08-24 18:08:40 +10:00
AP_OpticalFlow AP_OpticalFlow: allow use of OpticalFlow on SimOnHardWare 2022-08-24 18:27:32 +10:00
AP_Parachute AP_Parachute: params always use set method 2022-08-03 13:43:48 +01:00
AP_Param AP_Param: remove AP_ParamV `=` operator 2022-08-03 13:43:48 +01:00
AP_PiccoloCAN AP_PiccoloCAN: params always use set method 2022-08-03 13:43:48 +01:00
AP_Proximity AP_Proximity: Fix comments 2022-08-24 18:26:27 +10:00
AP_RAMTRON AP_RAMTRON: reduce scope for WITH_SEMAPHORE 2022-07-17 21:42:33 +10:00
AP_RCMapper AP_RCMapper: Increase parameter metadata range to match NUM_RC_CHANNELS 2022-06-21 09:57:44 +10:00
AP_RCProtocol AP_RCProtocol: fix examples 2022-08-19 18:33:58 +10:00
AP_RCTelemetry AP_RCTelemetry: don't spam mode changes on CRSF startup 2022-06-15 17:20:36 +10:00
AP_ROMFS AP_ROMFS: tidy includes 2022-05-03 09:14:58 +10:00
AP_RPM AP_RPM: added AP_Generator support 2022-08-30 10:53:45 +10:00
AP_RSSI
AP_RTC
AP_Radio AP_Radio: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_Rally AP_Rally: tidy creation of Location from RallyLocation 2022-07-14 11:49:53 +10:00
AP_RangeFinder AP_RangeFinder: fix examples 2022-08-19 18:33:58 +10:00
AP_Relay AP_Relay:Prevent operation for sim-on-hardware,add logs 2022-05-02 10:54:02 +10:00
AP_RobotisServo AP_RobotisServo: disable with minmimize features and 1mb flash 2022-06-15 18:05:44 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: fix examples 2022-08-19 18:33:58 +10:00
AP_Scripting AP_Scripting: VTOL-quiktune add back param for AUTO_FILTER 2022-08-26 16:45:45 +10:00
AP_SerialLED AP_SerialLED: enable 32 servo outs 2022-05-22 12:07:37 +10:00
AP_SerialManager AP_SerialManager: generalize EFI serial protocol name 2022-08-28 08:12:48 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: params always use set method 2022-08-03 13:43:48 +01:00
AP_Soaring AP_Soaring: make function const 2022-07-20 17:28:39 +10:00
AP_Stats
AP_TECS AP_TECS: use TECS log bitmask in constructor 2022-08-09 09:44:50 +10:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: rename HAL_MISSION_ENABLED to AP_MISSION_ENABLED 2022-08-18 22:49:10 +10: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: support OpenDroneID 2022-08-09 14:37:08 +10:00
AP_Vehicle AP_Vehicle: update notch count. 2022-08-30 10:03:31 +10:00
AP_VideoTX AP_VideoTX: params always use set method 2022-08-03 13:43:48 +01:00
AP_VisualOdom AP_VisualOdom: only include log structure if enabled 2022-07-13 18:14:12 +10:00
AP_Volz_Protocol AP_Volz: disable with minmimize features 2022-06-15 18:05:44 +10:00
AP_WheelEncoder AP_WheelEncoder: fix WheelEncoder_Quadrature timestamp. 2022-06-07 09:59:27 +10:00
AP_Winch AP_Winch: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_WindVane AP_WindVane: params always use set method 2022-08-03 13:43:48 +01: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: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
Filter Filter: params always use set method 2022-08-03 13:43:48 +01:00
GCS_MAVLink GCS_MAVLink: refuse DFU for secure firmware 2022-08-30 10:51:06 +10:00
PID PID: params always use set method 2022-08-03 13:43:48 +01:00
RC_Channel RC_Channel: add custom controller aux func 2022-08-30 13:10:09 +10:00
SITL SITL: integrate PRX parameter rename 2022-08-24 18:26:27 +10:00
SRV_Channel SRV_Channel: add ARM/MOTOR_EMERGENCY_STOP Aux Switch 2022-08-24 16:03:52 +10:00
StorageManager
doc