ardupilot/libraries
Andrew Tridgell 767773da5e SITL: improved multicopter simulation
this takes account of motor expo, velocity of air over propellers,
mass, size and other factors

It also allows for frame parameters to be supplied as an external json file
2020-10-28 14:20:44 +11:00
..
AC_AttitudeControl AC_AttitudeControl: added SMAX param docs 2020-10-25 10:32:48 +11:00
AC_Autorotation AC_Autorotation: remove unused variables 2020-10-01 21:13:20 +10:00
AC_AutoTune
AC_Avoidance AC_Avoid: hide params with enable flag 2020-09-14 08:54:13 +09:00
AC_Fence AC_Fence: remove dead and misleading assignment 2020-08-06 17:02:12 +10:00
AC_InputManager
AC_PID AC_PID: added slew limiter AC_PID 2020-10-25 10:32:48 +11:00
AC_PrecLand AC_PrecLand: correct @User field in ACC_P_NSE documentation 2020-09-22 14:56:04 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: remove unused reached_spline_destination 2020-10-07 15:41:18 +09:00
AP_AccelCal
AP_ADC
AP_ADSB AP_ADSB: conditionally compile based on HAL_ADSB_ENABLED 2020-10-07 19:11:38 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: Change the unit of barometric pressure from mbar to hPa. 2020-07-21 09:56:21 +10:00
AP_AHRS AP_AHRS: add ARSPD_OPTION note to WIND_MAX 2020-10-27 11:21:04 +11:00
AP_Airspeed AP_Airspeed: add MATLAB based NMEA sensor example 2020-10-27 11:24:49 +11:00
AP_Arming AP_Arming: arming check for osd menu 2020-09-09 20:36:42 +10:00
AP_Avoidance AP_Avoidance: conditionally compile based on ADSB support 2020-09-22 09:33:51 +10:00
AP_Baro AP_Baro: Delete unnecessary return processing 2020-10-27 10:48:52 +11:00
AP_BattMonitor AP_BattMonitor: Update @value field in param to be increasing order 2020-10-27 17:15:04 +11:00
AP_Beacon AP_Beacon: Nooploop driver 2020-10-15 08:07:46 +09:00
AP_BLHeli AP_BLHeli: added have_telem_data() API 2020-09-02 05:56:46 +10:00
AP_BoardConfig AP_BoardConfig: use AP_Filesystem for sdcard mount 2020-10-27 10:45:03 +11:00
AP_Button
AP_Camera AP_Camera: keep trying to initialize RunCam after boot 2020-09-16 18:00:53 +10:00
AP_CANManager AP_CANManager: redo filter configuration to make it work with STM32H7 2020-10-08 09:31:35 +11:00
AP_Common AP_Common: Update AP_FWVersion struct to be used with binary parsers 2020-10-07 19:32:12 +11:00
AP_Compass AP_Compass: Fix TYPEMASK bitmask 2020-10-27 15:40:25 +11:00
AP_Declination
AP_Devo_Telem
AP_EFI
AP_ESC_Telem AP_ESC_Telem: move to using CANManager library 2020-08-19 17:31:09 +10:00
AP_Filesystem AP_Filesystem: fixed build on gcc 9.3 2020-10-27 10:45:47 +11:00
AP_FlashStorage AP_FlashStorage: fixed alignment errors 2020-07-10 13:31:27 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: tidy mavlite message handling 2020-10-27 10:17:53 +11:00
AP_Generator AP_Generator: remove unused variables 2020-10-01 21:13:20 +10:00
AP_GPS AP_GPS: Don't reset the entire buffer when handling RTCM data 2020-10-25 14:21:39 +11:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: reduce locking to avoid contention and match thread priority to IO 2020-09-21 20:44:34 +10:00
AP_HAL AP_HAL: removed fs_init() 2020-10-27 10:45:03 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: go via AP_Filesystem for mount/unmount operations 2020-10-27 10:45:03 +11:00
AP_HAL_Empty AP_HAL_Empty: remove un-needed constructor 2020-10-13 19:55:34 +11:00
AP_HAL_Linux AP_HAL_Linux: Fix PWM FS to follow the Kernel's 4.X instead 3.9 2020-10-26 22:55:03 -07:00
AP_HAL_SITL SITL: add Maxell SMBus battery support 2020-10-26 20:34:05 +11:00
AP_Hott_Telem
AP_ICEngine AP_ICEngine: check for valid RC input for ICE 2020-09-14 12:20:55 +10:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Run vibration monitoring on all instances 2020-10-24 09:54:04 +11:00
AP_InternalError AP_InternalError: added an internal error for GPIO ISR overload 2020-10-02 09:38:24 +10:00
AP_IOMCU AP_IOMCU: fixed bug in SBUS output when scanning for FPort input 2020-10-07 16:44:13 +11:00
AP_IRLock
AP_JSButton
AP_KDECAN AP_KDECAN: remove KDECAN example KDECAN test is moved to CANTester 2020-08-20 07:44:53 +10:00
AP_L1_Control
AP_Landing AP_Landing: replace '@User: User' with '@User: Standard' 2020-09-22 14:56:04 +10:00
AP_LandingGear
AP_LeakDetector AP_LeakDetector: Add navigator support 2020-10-12 09:53:03 -07:00
AP_Logger AP_Logger: allow for retry of log open with LOG_DISARMED=1 2020-10-27 20:35:56 +11:00
AP_LTM_Telem
AP_Math AP_Math: added crc_sum8 2020-10-28 09:00:34 +11:00
AP_Menu
AP_Mission AP_Mission: add accessor for in_landing_flag() 2020-09-17 07:31:43 -07:00
AP_Module
AP_Motors AP_Motors: eliminate flags structure 2020-09-22 20:26:24 +10:00
AP_Mount AP_Mount: Improve instance validation check 2020-10-21 08:55:33 +09:00
AP_MSP AP_MSP: fixed build warnings for MSP with AP_Periph 2020-09-15 09:40:03 +10:00
AP_NavEKF AP_NavEKF: remove unused variables 2020-10-01 21:13:20 +10:00
AP_NavEKF2 AP_NavEKF2: minor comment fix 2020-10-28 12:17:22 +09:00
AP_NavEKF3 AP_NavEKF3: minor comment and format fixes 2020-10-28 12:17:40 +09:00
AP_Navigation
AP_NMEA_Output
AP_Notify AP_Notify: remove unused variables 2020-10-01 21:13:20 +10:00
AP_OLC AP_OLC: remove use of algorithm header 2020-10-01 09:40:45 +10:00
AP_OpticalFlow AP_OpticalFlow: aligned msp message data struct name to gps,baro and mag 2020-09-09 06:35:50 +10:00
AP_OSD AP_OSD: get wind speed from wind vane on rover 2020-10-13 11:39:43 +11:00
AP_Parachute AP_Parachute: move sink rate check to new method 2020-10-06 16:14:59 +11:00
AP_Param AP_Param: Ignore FORMAT_VERSION param when loading SITL defaults 2020-10-20 10:30:17 +11:00
AP_PiccoloCAN AP_PiccoloCAN: Constrain ESC command message rate 2020-09-09 15:31:21 +10:00
AP_Proximity AP_Proximity: simplify get_horizontal_distances 2020-10-06 20:52:29 +11:00
AP_Radio
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: remove unused variables 2020-10-01 21:13:20 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: added FPort protocol test 2020-10-28 09:00:34 +11:00
AP_RCTelemetry AP_RCTelemetry: integrate ahrs::get_variances change 2020-10-21 08:58:45 +09:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo
AP_ROMFS
AP_RPM
AP_RSSI AP_RSSI: create and use new AP_HAL::PWMSource object 2020-09-08 16:10:50 +10:00
AP_RTC AP_RTC: added mktime(), used by AP_Filesystem and AP_GPS 2020-10-20 11:21:00 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: add the fast loop to task statistics 2020-10-07 18:08:19 +11:00
AP_Scripting AP_Scripting: copter-wall-climber fix for climb rate limiting 2020-10-27 14:06:15 +09:00
AP_SerialLED
AP_SerialManager AP_SerialManager: add airspeed type 2020-10-27 11:24:49 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: fixed build warning on gcc9 2020-09-22 08:07:23 +10:00
AP_Soaring AP_Soaring: remove unused variables 2020-10-01 21:13:20 +10:00
AP_SpdHgtControl
AP_Stats
AP_TECS AP_TECS: replace '@User: User' with '@User: Standard' 2020-09-22 14:56:04 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: fix TSYS01 warning on SITL 2020-02-05 17:10:58 -05:00
AP_Terrain AP_Terrain: fix snprintf-overflow compilation error 2020-08-07 12:36:12 +10:00
AP_ToshibaCAN AP_ToshibaCAN: use new CANIface drivers and CANManager 2020-08-19 17:31:09 +10:00
AP_Tuning
AP_UAVCAN AP_UAVCAN: save some stack space 2020-10-08 09:31:35 +11:00
AP_Vehicle AP_vehicle: added support for frsky bidirectional telemetry 2020-10-27 10:17:53 +11:00
AP_VisualOdom AP_VisualOdom: T265 ignores position and speed for 1sec after reset 2020-10-06 09:18:04 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: added SMAX param docs 2020-10-25 10:32:48 +11:00
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 2020-09-09 11:56:00 +09:00
AP_WindVane AP_WindVane: report apparent wind with named float 2020-09-30 17:03:58 +10:00
APM_Control APM_Control: added SMAX param docs 2020-10-25 10:32:48 +11:00
AR_WPNav AR_WPNav: minor param description typo fix 2020-08-07 08:30:03 +09:00
doc doc: Fix typos 2016-05-13 19:20:06 -03:00
Filter Filter: added slew rate filter 2020-10-25 10:32:48 +11:00
GCS_MAVLink GCS_MAVLink: use micro64 instead of micros for time_usec 2020-10-27 15:37:29 +11:00
PID
RC_Channel RC_Channel: add RC option for landing flare 2020-10-13 11:36:19 +11:00
SITL SITL: improved multicopter simulation 2020-10-28 14:20:44 +11:00
SRV_Channel SRV_Channels: refactor zero_rc_outputs() out of GCS_Mavlink 2020-09-29 18:07:59 +10:00
StorageManager