ardupilot/libraries
Peter Barker c8a368d896 AP_Generator: update prearm checks, fill new GENERATOR_STATUS fields
AP_Generator_Richenpower: only update servo channel while disarmed

AP_Generator_Richenpower: move warning for servo output channel to prearm checks

AP_Generator: state is simply off if RPM is zero

AP_Generator: send runtime and seconds-until-maintenance in GENERATOR_STATUS

AP_Generator_RichenPower: correct runtime seconds/minutes position in packets

AP_Generator_RichenPower: correct and expand use of mode packet entry

AP_Generator_RichenPower: fail prearm check if generator not seen

AP_Generator_RichenPower: make prearm check for needing maintenance  warn-only

AP_Generator_RichenPower: rename runstate to pilot_desired_runstate

AP_Generator_RichenPower: tweak decoding of time-to-maintenance

AP_Generator: add hysteresis for warmup/cooldown in IDLE

AP_Generator: stop generator in case of vehicle crash

AP_Generator: generator must go through idle from run to stop

AP_Generator: emit statustext when generator configured but not present

AP_Generator: do not log if LOG_BITMASK is zero

AP_Generator: do not warn user if generator configured but not present

They won't be able to start the generator if we can't see it.

Don't update the runstate if no readings seen.

AP_Generator: do not send generator status if no readings seen
2020-08-05 16:26:19 +09:00
..
AC_AttitudeControl AC_PosControl: correct VELXY_D_FILT Description 2020-06-23 11:40:12 +09:00
AC_Autorotation AC_Autorotation: add documentation for AROT message 2020-07-21 17:45:55 +10:00
AC_AutoTune AC_AutoTune: set FLTT to zero while twitching 2020-06-30 20:09:48 +10:00
AC_Avoidance AC_Avoid: Back away if vehicle breaches margin to obstacle/fence 2020-08-05 15:37:04 +09:00
AC_Fence AC_Fence: Add Pre-Arm check for margin < radius 2020-08-05 15:37:04 +09:00
AC_InputManager AC_InputManager: tradheli-Fix parameter metadata errors 2020-01-13 12:41:30 -05:00
AC_PID AC_PID: added AC_PI controller 2019-11-02 16:31:04 +11:00
AC_PrecLand AC_PrecLand: POS param range of 5m and 1cm increment 2020-02-01 08:46:03 +09:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_Circle: constantly update velocity from params 2020-06-24 08:57:08 +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: add missing break statement 2020-01-15 13:55:42 +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: provide accessor for synthetic airspeed 2020-08-04 23:12:03 +10:00
AP_Airspeed AP_Airspeed: fix airspeed messages for consistency 2020-07-21 09:41:05 +10:00
AP_Arming AP_Arming: default throttle pre-arm check to enabled 2020-08-04 10:26:45 +10:00
AP_Avoidance AP_Avoidance: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_Baro AP_Baro: added device IDs for barometers 2020-07-21 08:20:01 +09:00
AP_BattMonitor AP_BattMonitor: add backend for generator supply 2020-07-03 08:21:42 +09:00
AP_Beacon AP_Beacon: Change the tab code to whitespace 2020-04-27 09:32:56 +09:00
AP_BLHeli AP_BLHeli: log telemetry at 10Hz 2020-07-07 11:44:33 +10:00
AP_BoardConfig AP_BoardConfig: use polarity for 3.3/5v selection 2020-07-21 08:47:27 +10:00
AP_Button AP_Button: add crude debouncing and get_button_state function 2020-03-19 14:59:34 -07:00
AP_Camera AP_Camera: make solo gimbal inclusion configurable per-board 2020-08-04 09:18:14 +10:00
AP_Common AP_Common: added strncpy_noterm 2020-07-10 13:32:24 +10:00
AP_Compass AP_Compass: support probing RM3100 on all 4 addresses 2020-08-02 12:25:29 +10:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_EFI AP_EFI: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ESC_Telem AP_ESC_Telem: wrapper for ESCs with feedback 2020-02-12 11:58:34 +09:00
AP_Filesystem AP_Filesystem: correct comparison of signed/unsigned 2020-05-04 12:06:30 +10:00
AP_FlashStorage AP_FlashStorage: fixed alignment errors 2020-07-10 13:31:27 +10:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: fix frsky serial 10 parameters 2020-07-20 20:36:34 +10:00
AP_Generator AP_Generator: update prearm checks, fill new GENERATOR_STATUS fields 2020-08-05 16:26:19 +09:00
AP_GPS AP_GPS: redetection not necessary for UAVCAN GPS 2020-07-29 17:32:56 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: slew FFT frequency output 2020-08-05 17:20:03 +10:00
AP_HAL AP_HAL: set base type of FrequencyPeak to uint8_t 2020-08-05 17:20:03 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: disable AP_Mount on "mini" boards 2020-08-04 09:18:14 +10:00
AP_HAL_Empty AP_HAL_Empty: add discard_input method on UARTDriver 2020-05-26 09:20:32 +10:00
AP_HAL_Linux HAL_Linux: fixed build warnings in RC input methods 2020-07-07 10:23:00 +10:00
AP_HAL_SITL AP_HAL_SITL: simulated i2c support 2020-08-04 21:40:21 +10:00
AP_Hott_Telem AP_Hott_Telem: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_ICEngine AP_ICEngine: convert to new get_rpm() API 2020-03-12 08:36:40 +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: remove ICM gyro pre-filter 2020-08-04 09:24:16 +10:00
AP_InternalError AP_InternalError: use strncpy_noterm 2020-07-10 13:32:24 +10:00
AP_IOMCU AP_IOMCU: use new UARTDriver discard_input method 2020-05-26 09:20:32 +10:00
AP_IRLock AP_IRLock: Change the tab code to whitespace 2020-04-27 09:29:11 +09:00
AP_JSButton AP_JSButton: Add servo toggle button function 2017-12-28 14:14:47 -05:00
AP_KDECAN AP_KDECAN: regularise CAN pre-arm failure messages 2020-05-05 11:27:53 +10: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: implement continue after land for fixed wing landings 2020-06-02 09:12:22 +09:00
AP_LandingGear AP_LandingGear: Change the tab code to whitespace 2020-04-27 09:29:18 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: Log Simple Avoidance 2020-08-05 15:37:04 +09:00
AP_LTM_Telem AP_LTM_Telem: LTM telemetry support 2019-11-26 12:14:13 +11:00
AP_Math AP_Math: ensure that we use environment Python interpreter 2020-08-03 14:02:09 +10:00
AP_Menu AP_Menu: use strtof() instead of atof() 2019-10-28 15:53:16 +11:00
AP_Mission AP_Mission: NFC Correct some comments 2020-07-17 09:12:48 +09:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: remove names from cpp files 2020-07-14 13:27:07 +10:00
AP_Mount AP_Mount: make mount/gimbal inclusion configurable per-board and disable Solo gimbal on all 1MB boards 2020-08-04 09:18:14 +10:00
AP_NavEKF AP_NavEKF: Enable external setting of yaw estimator bias states 2020-07-07 15:33:58 +10:00
AP_NavEKF2 AP_NavEKF2: INS get_sample_rate() renamed to get_loop_rate_hz() 2020-07-10 16:45:29 +10:00
AP_NavEKF3 AP_NavEKF3: fix comments 2020-08-04 18:16:18 +10:00
AP_Navigation AP_L1_Control: update_waypoint gets dist_min argument 2018-04-05 12:14:59 +09:00
AP_NMEA_Output AP_NMEA_Output: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Notify AP_Notify: remove recursive call to play in next_action 2020-03-31 11:06:30 +11:00
AP_OpticalFlow AP_OpticalFlow: Change the tab code to whitespace 2020-04-27 09:29:39 +09:00
AP_OSD AP_OSD: ensure that we use environment Python interpreter 2020-08-03 14:02:09 +10:00
AP_Parachute AP_Parachute: Fix singleton panic message 2020-05-05 07:43:02 +10:00
AP_Param AP_Param: fixed race in param count handling 2020-04-29 07:36:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: regularise CAN pre-arm failure messages 2020-05-05 11:27:53 +10:00
AP_Proximity AP_Proximity: remove unused definition 2020-07-24 15:35:53 +09:00
AP_Radio AP_Radio: correct for recent semaphore bool/void changes 2020-03-03 21:56:33 +09:00
AP_Rally AP_Rally: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_RAMTRON AP_RAMTRON: fixed build with gcc 9.x 2020-04-01 17:08:48 +11:00
AP_RangeFinder AP_RangeFinder: fixed legacy parsing of 65436 for lightware i2c 2020-07-30 11:25:05 +10:00
AP_RCMapper AP_RCMapper: add singleton 2019-12-30 13:02:04 +11:00
AP_RCProtocol AP_RCProtocol: fix segfault in example due to lack of VideoTX singleton 2020-07-31 07:55:09 +10:00
AP_RCTelemetry AP_RCTelemetry: add setters for vtx configuration 2020-07-14 16:50:08 +10:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_ROMFS AP_ROMFS: added directory listing interface 2020-03-28 15:28:03 +11:00
AP_RPM AP_RPM: allow harmonic notch driver to appear as RPM values. 2020-04-14 09:43:16 +10:00
AP_RSSI AP_RSSI: add RADIO_STATUS.rssi as an AP_RSSI telemetry source 2020-06-09 10:20:29 +10:00
AP_RTC AP_RTC: use GCS_SEND_TEXT() 2020-04-29 07:36:55 +10:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: allow registration of tasks at loop rate 2020-02-22 11:15:37 +11:00
AP_Scripting AP_Scripting: add default case to fix uninitialised use situation 2020-07-30 20:28:48 +10:00
AP_SerialLED AP_SerialLED: support ProfiLEDs 2020-03-10 10:37:26 +11:00
AP_SerialManager AP_SerialManager: Add a helper to report if a serial link should have it's MAVLink data forwarded 2020-07-22 07:17:49 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: do-set-servo affects sprayer and gripper 2020-02-11 11:08:02 +11:00
AP_SmartRTL AP_SmartRTL: EKF objects have moved into AP_AHRS_NavEKF 2020-01-21 11:53:18 +11:00
AP_Soaring AP_Soaring: Fix description of SOAR_MAX_DRIFT. 2020-07-31 10:26:50 -07:00
AP_SpdHgtControl AP_TECS: Add flags to indicate gliding flight, and use these with AP_Soaring. 2020-04-08 09:11:54 +10:00
AP_Stats AP_Stats: make all semaphores recursive 2020-01-19 20:19:30 +11:00
AP_TECS AP_TECS: Don't fetch the land slewrate if it's not needed 2020-07-31 10:30:17 -07:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: fix TSYS01 warning on SITL 2020-02-05 17:10:58 -05:00
AP_Terrain AP_Terrain: allow download of terrain data when no GPS lock 2020-07-28 12:15:43 +10:00
AP_ToshibaCAN AP_ToshibaCAN: correct checking of payload space in telem send 2020-07-21 09:14:22 +10:00
AP_Tuning AP_Tuning: add documentation for PRTN message 2020-04-14 07:34:59 +10:00
AP_UAVCAN AP_UAVCAN: handle pop from rx_queue failing 2020-07-20 10:19:47 +09:00
AP_Vehicle AP_Vehicles: add more ModeReasons 2020-07-28 11:52:39 -07:00
AP_VisualOdom AP_VisualOdom: Shorten the distinguished name. 2020-07-28 09:09:27 +09:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: Change the tab code to whitespace 2020-04-27 09:32:15 +09: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_NMEA: decode each sentence once 2020-07-29 17:40:03 +10:00
APM_Control APM_Control: Add gyro feedback limit cycle protection 2020-07-13 13:47:50 +10:00
AR_WPNav AR_WPNav: Reset WP origin if recovering from OA 2020-05-30 08:55:45 +09:00
doc
Filter Filter: return active harmonics based on dynamic harmonic enablement 2020-07-14 09:50:06 +10:00
GCS_MAVLink GCS_MAVLink: make mount/gimbal configurable on a per-board basis 2020-08-04 09:18:14 +10:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: default throttle pre-arm check to enabled 2020-08-04 10:26:45 +10:00
SITL SITL: add simulated MaxSonarI2CXL i2c sensor 2020-08-04 21:40:21 +10:00
SRV_Channel SRV_Channel: grab a servo function to control the RichenPower generators 2020-07-03 08:21:42 +09:00
StorageManager StorageManager: use pragmas to set storage layout rather than call 2020-01-28 11:34:51 +11:00