ardupilot/libraries
Peter Barker 6a862c6e24 SITL: make home location parsing verbose
Given we don't fail to start SITL if the home location fails to parse,
we should at least make the user very aware that their home location
string is bad.

This commit makes failures verbose, and outputs the parsed location
values rather than regurgitating the location string the user supplied;
it was very misleading in that the location could simply fail to parse
and thus be unused.
2018-02-21 23:51:56 +10:00
..
AC_AttitudeControl AC_PosControl: default gains for sub 2018-01-31 08:48:21 +09:00
AC_Avoidance AC_Avoid: reduce min and default DIST_MAX values 2018-01-25 11:16:01 +09:00
AC_Fence AC_Fence: hide ALT_MAX parameter from Rover 2018-01-22 20:42:31 +09:00
AC_InputManager AC_InputManager: removed create() method for objects 2017-12-14 08:12:28 +11:00
AC_PID AC_PID: fixes after peer review of AC_PID_2D 2018-01-23 12:00:43 +09:00
AC_PrecLand AC_PrecLand: removed create() method for objects 2017-12-14 08:12:28 +11:00
AC_Sprayer AC_Sprayer: removed create() method for objects 2017-12-14 08:12:28 +11:00
AC_WPNav AC_WPNav: minor formatting fix 2018-02-02 20:55:20 +09:00
APM_Control AR_AttitudeControl: minor arg name fix 2018-02-09 17:36:21 +09:00
AP_ADC Global: change Device::PeriodicCb signature 2017-01-14 10:03:54 +11:00
AP_ADSB AP_ADSB: fix spelling in comments 2018-02-21 22:15:45 +09:00
AP_AHRS AP_AHRS: fixed AP_MODULE_SUPPORTED 2018-02-10 10:50:22 +11:00
AP_AccelCal AccelCal: Continously report success/failure to the GCS that requested the calibration 2017-06-01 20:20:05 +01:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: Report MAV_PROTOCOL_CAPABILITY_FLIGHT_TERMINATION 2018-02-03 09:36:03 +09:00
AP_Airspeed AP_Airspeed: Fix ARSPD2_TYPE docs 2018-01-26 13:19:53 -08:00
AP_Arming AP_Arming: check all airspeed sensors are healthy 2018-01-16 07:14:20 +11:00
AP_Avoidance AP_AVOIDANCE: Minimum altitude for avoidance action 2017-12-30 13:50:42 -08:00
AP_Baro AP_Baro: support SP01 board 2018-02-14 18:27:00 +11:00
AP_BattMonitor AP_BattMonitor: allow hwdef.dat config of battery pins 2018-02-07 20:33:45 +11:00
AP_Beacon AP_Beacon: fixed example build on ChibiOS 2018-01-15 11:46:02 +11:00
AP_BoardConfig AP_BoardConfig: added SP01 board type 2018-02-14 18:27:00 +11:00
AP_Buffer Global: remove mode line from headers 2016-10-24 09:42:01 -02:00
AP_Button Global: remove mode line from headers 2016-10-24 09:42:01 -02:00
AP_Camera AP_Camera: delete \n from the log using gcs().send_text 2018-02-02 09:40:05 +09:00
AP_Common AP_Common: added ARRAY_SIZE_SIMPLE() 2018-01-15 11:46:02 +11:00
AP_Compass AP_Compass: added SP01 board type 2018-02-14 18:27:00 +11:00
AP_Declination AP_Declination: added inclination and intensity tables 2018-02-08 17:36:33 +11:00
AP_FlashStorage AP_FlashStorage: fixed two bugs found by night-ghost 2018-02-02 14:19:12 +09:00
AP_Frsky_Telem AP_Frsky_Telem: fixed build warnings 2018-02-10 09:14:41 +11:00
AP_GPS AP_GPS: add param defaults for EMLID_EDGE for GPS_TYPE=9 2018-02-13 15:29:53 +11:00
AP_Gripper AP_Gripper: build fix for ChibiOS 2018-01-15 11:46:02 +11:00
AP_HAL AP_HAL: added crazyflie2 2018-02-14 18:27:00 +11:00
AP_HAL_AVR
AP_HAL_ChibiOS HAL_ChibiOS: correct LSM9DS0 bus IDs to match HAL_PX4 2018-02-19 15:49:32 +11:00
AP_HAL_Empty HAL_Empty: fixed I2C get_device() interface 2018-01-15 11:46:02 +11:00
AP_HAL_F4Light modules: added submodules for HAL_F4Light 2018-02-10 09:14:41 +11:00
AP_HAL_FLYMAPLE
AP_HAL_Linux AP_HAL_Linux: rpi: sort include headers 2018-02-12 09:05:21 -08:00
AP_HAL_PX4 HAL_PX4: allow for different LED pins 2018-02-14 18:27:00 +11:00
AP_HAL_QURT HAL_QURT: implement _timer_tick in UARTDriver 2018-02-07 20:33:45 +11:00
AP_HAL_SITL SITL: make home location parsing verbose 2018-02-21 23:51:56 +10:00
AP_HAL_VRBRAIN HAL_VRBrain: Storage::_timer_tick is an override 2018-02-07 20:33:45 +11:00
AP_ICEngine AP_IceEngine: eliminate GCS_MAVLINK::send_statustext_all 2017-07-11 23:53:53 +01:00
AP_IOMCU AP_IOMCU: fix data type for available bytes 2018-02-07 20:33:45 +11:00
AP_IRLock AP_IRLock: added override keyword 2017-04-14 08:47:39 +10:00
AP_InertialNav AP_InertialNav: remove unused get_hgt_ctrl_limit 2017-12-08 11:27:37 +09:00
AP_InertialSensor AP_InertialSensor: added SP01 board type 2018-02-14 18:27:00 +11:00
AP_JSButton AP_JSButton: Add servo toggle button function 2017-12-28 14:14:47 -05:00
AP_L1_Control AP_L1_Control: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Landing AP_Landing: use GPS singleton 2017-12-27 00:58:02 +00:00
AP_LandingGear AP_LandingGear: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_LeakDetector AP_LeakDetector: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Math AP_Math: add Vector2f::circle_segment_intersection 2018-01-22 17:18:41 +09:00
AP_Menu AP_Menu: Unify from print or println to printf. 2017-01-27 18:20:22 +11:00
AP_Mission AP_Mission: AP_AHRS no longer requires GPS in constructor 2017-12-27 00:58:02 +00:00
AP_Module AP_Module: fixed AP_MODULE_SUPPORTED defines 2018-02-10 10:50:22 +11:00
AP_Motors AP_Motors: reduce unnecessary multiple call of get_compensation_gain() 2018-01-24 19:26:15 +09:00
AP_Mount AP_Mount: use GPS singleton 2017-12-27 00:58:02 +00:00
AP_NavEKF AP_NavEKF: Add monitoring of average EKF time step 2017-04-29 11:03:44 +10:00
AP_NavEKF2 AP_NavEKF2: allocate NavEKF core from MEM_FAST region 2018-01-15 11:46:02 +11:00
AP_NavEKF3 AP_NavEKF3: Fix origin height estimator indexing bug 2018-02-21 17:04:30 +10:00
AP_Navigation AP_Navigation: Add a loiter radius interface 2017-04-06 08:26:04 +10:00
AP_Notify AP_Notify: allow ChibiOS to use PixracerLED driver 2018-02-14 18:27:00 +11:00
AP_OpticalFlow AP_OpticalFlow: support SP01 board 2018-02-14 18:27:00 +11:00
AP_Parachute AP_Parachute: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Param AP_Param: added back key dumping code 2018-01-24 18:23:59 +11:00
AP_Param_Helper AP_Param_Helper: param table support for HAL 2018-02-10 09:14:41 +11:00
AP_Proximity AP_Proximity: add support for RP Lidar A2 2017-09-18 08:28:11 +09:00
AP_RAMTRON AP_RAMTRON: added RAMTRON fram device driver 2018-01-15 11:46:02 +11:00
AP_RCMapper AP_RCMapper: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_RCProtocol AP_RCProtocol: tidy up frontend/backend split 2018-01-20 17:40:07 +11:00
AP_RPM VRBRAIN / AP_RPM: removed RPM_PX4_PWM for VR Brain 5.1 and VR Micro Brain 5.2 (they haven't this input pin) 2018-02-05 08:26:49 +11:00
AP_RSSI AP_RSSI: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Radio AP_Radio: allow build of AP_Radio under PX4 2018-02-08 17:36:33 +11:00
AP_Rally AP_Rally: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_RangeFinder VRBRAIN / AP_RangeFinder: removed AP_RangeFinder_PX4_PWM for VR Brain boards 2018-02-05 08:26:49 +11:00
AP_Relay AP_Relay: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_SBusOut AP_SBusOut: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Scheduler AP_Scheduler: initialise _last_loop_time_s in init() 2018-02-13 17:15:05 +11:00
AP_SerialManager AP_SerialManager: allow hwdef.dat setup of serial5 config 2018-02-07 20:33:45 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_SmartRTL AP_SmartRTL: attempts to set home in update 2018-01-17 11:03:33 +09:00
AP_Soaring AP_Soaring: delete \n from the log using gcs().send_text 2018-02-02 09:41:23 +09:00
AP_SpdHgtControl AP_SpdHgtControl: added function to reset integrator 2017-03-14 08:20:48 +11:00
AP_Stats AC_Stats: NFC Statistics are read-only variables 2017-06-07 19:53:09 +09:00
AP_TECS AP_TECS: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_TempCalibration AP_TempCalibration: fixed build warning 2018-02-08 17:36:33 +11:00
AP_TemperatureSensor AP_TemperatureSensor: use HAL_SEMAPHORE_BLOCK_FOREVER macro 2017-05-08 10:23:03 +09:00
AP_Terrain AP_Terrain: fix snprintf buffer length warning 2018-02-02 09:59:06 +09:00
AP_Tuning AP_Tuning: eliminate GCS_MAVLINK::send_statustext_all 2017-07-11 23:53:53 +01:00
AP_UAVCAN AP_UAVCAN: non-functional change - fix style 2018-02-10 23:48:23 -08:00
AP_Vehicle AP_Vehicle: Add the ArduSub vehicle type. 2017-02-21 11:26:14 +11:00
AP_VisualOdom AP_VisualOdom: class accepts deltas from visual odom camera 2017-04-19 11:04:40 +09:00
AP_Volz_Protocol AP_Volz_Protocol: use AP::serialmanager() 2017-12-21 04:35:11 +00:00
AP_WheelEncoder AP_WheelEncoder: hide parameters by default 2018-02-12 12:16:41 +09:00
AP_Winch AP_Winch: remove redundant member 2017-10-27 09:20:38 +09:00
DataFlash DataFlash: move logging of PM messages to AP_Scheduler 2018-02-13 17:15:05 +11:00
Filter Filter: added a notch filter 2017-08-29 13:52:29 +10:00
GCS_MAVLink GCS_MAVLink: handle reset params to defaults command 2018-02-20 10:49:09 +11:00
PID PID: Add a full reset method 2017-10-17 14:37:11 -07:00
RC_Channel RC_Channel: added set_and_save_radio_trim() 2018-02-08 17:36:33 +11:00
SITL SITL: make home location parsing verbose 2018-02-21 23:51:56 +10:00
SRV_Channel SRV_Channels: fix for replay 2018-01-15 11:46:02 +11:00
StorageManager StorageManager: fixed header order 2018-02-10 09:14:41 +11:00
doc