2015-05-29 23:12:49 -03:00
|
|
|
/*
|
|
|
|
This program is free software: you can redistribute it and/or modify
|
|
|
|
it under the terms of the GNU General Public License as published by
|
|
|
|
the Free Software Foundation, either version 3 of the License, or
|
|
|
|
(at your option) any later version.
|
|
|
|
|
|
|
|
This program is distributed in the hope that it will be useful,
|
|
|
|
but WITHOUT ANY WARRANTY; without even the implied warranty of
|
|
|
|
MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
|
|
|
|
GNU General Public License for more details.
|
|
|
|
|
|
|
|
You should have received a copy of the GNU General Public License
|
|
|
|
along with this program. If not, see <http://www.gnu.org/licenses/>.
|
|
|
|
*/
|
2016-05-05 19:10:08 -03:00
|
|
|
#pragma once
|
2015-05-29 23:12:49 -03:00
|
|
|
/*
|
|
|
|
This is the main Copter class
|
|
|
|
*/
|
|
|
|
|
|
|
|
////////////////////////////////////////////////////////////////////////////////
|
|
|
|
// Header includes
|
|
|
|
////////////////////////////////////////////////////////////////////////////////
|
|
|
|
|
2016-03-31 18:43:36 -03:00
|
|
|
#include <cmath>
|
2015-05-29 23:12:49 -03:00
|
|
|
#include <stdio.h>
|
|
|
|
#include <stdarg.h>
|
|
|
|
|
2015-10-19 15:25:33 -03:00
|
|
|
#include <AP_HAL/AP_HAL.h>
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Common dependencies
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_Common/AP_Common.h>
|
2015-08-13 22:12:10 -03:00
|
|
|
#include <AP_Common/Location.h>
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_Param/AP_Param.h>
|
|
|
|
#include <StorageManager/StorageManager.h>
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// Application dependencies
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <GCS_MAVLink/GCS.h>
|
|
|
|
#include <AP_SerialManager/AP_SerialManager.h> // Serial manager library
|
|
|
|
#include <AP_GPS/AP_GPS.h> // ArduPilot GPS library
|
|
|
|
#include <DataFlash/DataFlash.h> // ArduPilot Mega Flash Memory Library
|
|
|
|
#include <AP_ADC/AP_ADC.h> // ArduPilot Mega Analog to Digital Converter Library
|
|
|
|
#include <AP_Baro/AP_Baro.h>
|
|
|
|
#include <AP_Compass/AP_Compass.h> // ArduPilot Mega Magnetometer Library
|
|
|
|
#include <AP_Math/AP_Math.h> // ArduPilot Mega Vector/Matrix math Library
|
2015-10-16 19:05:53 -03:00
|
|
|
#include <AP_AccelCal/AP_AccelCal.h> // interface and maths for accelerometer calibration
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_InertialSensor/AP_InertialSensor.h> // ArduPilot Mega Inertial Sensor (accel & gyro) Library
|
|
|
|
#include <AP_AHRS/AP_AHRS.h>
|
2015-09-21 02:28:04 -03:00
|
|
|
#include <AP_NavEKF2/AP_NavEKF2.h>
|
2016-07-14 02:08:43 -03:00
|
|
|
#include <AP_NavEKF3/AP_NavEKF3.h>
|
2017-08-09 06:21:33 -03:00
|
|
|
#include <AP_Mission/AP_Mission.h> // Mission command library
|
2017-11-20 07:26:32 -04:00
|
|
|
#include <AC_PID/AC_P.h> // P library
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AC_PID/AC_PID.h> // PID library
|
2017-11-20 07:26:32 -04:00
|
|
|
#include <AC_PID/AC_PI_2D.h> // PI library (2-axis)
|
|
|
|
#include <AC_PID/AC_PID_2D.h> // PID library (2-axis)
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AC_PID/AC_HELI_PID.h> // Heli specific Rate PID library
|
|
|
|
#include <AC_AttitudeControl/AC_AttitudeControl_Multi.h> // Attitude control library
|
|
|
|
#include <AC_AttitudeControl/AC_AttitudeControl_Heli.h> // Attitude control library for traditional helicopter
|
|
|
|
#include <AC_AttitudeControl/AC_PosControl.h> // Position control library
|
|
|
|
#include <RC_Channel/RC_Channel.h> // RC Channel Library
|
|
|
|
#include <AP_Motors/AP_Motors.h> // AP Motors library
|
|
|
|
#include <AP_RangeFinder/AP_RangeFinder.h> // Range finder library
|
2016-08-15 03:53:45 -03:00
|
|
|
#include <AP_Proximity/AP_Proximity.h>
|
2016-10-13 03:30:30 -03:00
|
|
|
#include <AP_Stats/AP_Stats.h> // statistics library
|
2016-10-24 02:46:33 -03:00
|
|
|
#include <AP_Beacon/AP_Beacon.h>
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_OpticalFlow/AP_OpticalFlow.h> // Optical Flow library
|
2015-08-28 03:00:55 -03:00
|
|
|
#include <AP_RSSI/AP_RSSI.h> // RSSI Library
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <Filter/Filter.h> // Filter library
|
|
|
|
#include <AP_Buffer/AP_Buffer.h> // APM FIFO Buffer
|
|
|
|
#include <AP_Relay/AP_Relay.h> // APM relay
|
|
|
|
#include <AP_ServoRelayEvents/AP_ServoRelayEvents.h>
|
|
|
|
#include <AP_Camera/AP_Camera.h> // Photo or video camera
|
|
|
|
#include <AP_Mount/AP_Mount.h> // Camera/Antenna mount
|
|
|
|
#include <AP_Airspeed/AP_Airspeed.h> // needed for AHRS build
|
|
|
|
#include <AP_Vehicle/AP_Vehicle.h> // needed for AHRS build
|
|
|
|
#include <AP_InertialNav/AP_InertialNav.h> // ArduPilot Mega inertial navigation library
|
|
|
|
#include <AC_WPNav/AC_WPNav.h> // ArduCopter waypoint navigation library
|
|
|
|
#include <AC_WPNav/AC_Circle.h> // circle navigation library
|
|
|
|
#include <AP_Declination/AP_Declination.h> // ArduPilot Mega Declination Helper Library
|
|
|
|
#include <AC_Fence/AC_Fence.h> // Arducopter Fence library
|
2016-06-20 05:27:14 -03:00
|
|
|
#include <AC_Avoidance/AC_Avoid.h> // Arducopter stop at fence library
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_Scheduler/AP_Scheduler.h> // main loop scheduler
|
|
|
|
#include <AP_RCMapper/AP_RCMapper.h> // RC input mapping library
|
|
|
|
#include <AP_Notify/AP_Notify.h> // Notify library
|
|
|
|
#include <AP_BattMonitor/AP_BattMonitor.h> // Battery monitor library
|
|
|
|
#include <AP_BoardConfig/AP_BoardConfig.h> // board configuration library
|
2017-05-06 06:11:50 -03:00
|
|
|
#include <AP_BoardConfig/AP_BoardConfig_CAN.h>
|
2016-01-20 20:38:39 -04:00
|
|
|
#include <AP_LandingGear/AP_LandingGear.h> // Landing Gear library
|
|
|
|
#include <AP_Terrain/AP_Terrain.h>
|
|
|
|
#include <AP_ADSB/AP_ADSB.h>
|
|
|
|
#include <AP_RPM/AP_RPM.h>
|
|
|
|
#include <AC_InputManager/AC_InputManager.h> // Pilot input handling library
|
|
|
|
#include <AC_InputManager/AC_InputManager_Heli.h> // Heli specific pilot input handling library
|
2016-07-21 22:24:13 -03:00
|
|
|
#include <AP_Button/AP_Button.h>
|
2017-01-09 03:45:48 -04:00
|
|
|
#include <AP_Arming/AP_Arming.h>
|
2017-03-01 07:18:11 -04:00
|
|
|
#include <AP_VisualOdom/AP_VisualOdom.h>
|
2017-09-08 23:45:31 -03:00
|
|
|
#include <AP_SmartRTL/AP_SmartRTL.h>
|
2017-04-13 00:20:12 -03:00
|
|
|
#include <AP_TempCalibration/AP_TempCalibration.h>
|
2016-01-20 20:38:39 -04:00
|
|
|
|
|
|
|
// Configuration
|
|
|
|
#include "defines.h"
|
|
|
|
#include "config.h"
|
|
|
|
|
2016-05-27 09:59:22 -03:00
|
|
|
#include "GCS_Mavlink.h"
|
2017-02-13 22:14:55 -04:00
|
|
|
#include "GCS_Copter.h"
|
2016-07-19 19:52:56 -03:00
|
|
|
#include "AP_Rally.h" // Rally point library
|
2016-12-26 04:05:08 -04:00
|
|
|
#include "AP_Arming.h"
|
2016-05-27 09:59:22 -03:00
|
|
|
|
2016-01-20 20:38:39 -04:00
|
|
|
// libraries which are dependent on #defines in defines.h and/or config.h
|
2015-05-29 23:12:49 -03:00
|
|
|
#if SPRAYER == ENABLED
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AC_Sprayer/AC_Sprayer.h> // crop sprayer library
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
2016-10-28 19:08:22 -03:00
|
|
|
#if GRIPPER_ENABLED == ENABLED
|
|
|
|
#include <AP_Gripper/AP_Gripper.h> // gripper stuff
|
|
|
|
#endif
|
2015-05-29 23:12:49 -03:00
|
|
|
#if PARACHUTE == ENABLED
|
2015-08-11 03:28:40 -03:00
|
|
|
#include <AP_Parachute/AP_Parachute.h> // Parachute release library
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
2015-02-16 00:39:18 -04:00
|
|
|
#if PRECISION_LANDING == ENABLED
|
|
|
|
#include <AC_PrecLand/AC_PrecLand.h>
|
|
|
|
#include <AP_IRLock/AP_IRLock.h>
|
|
|
|
#endif
|
2016-05-03 12:01:07 -03:00
|
|
|
#if FRSKY_TELEM_ENABLED == ENABLED
|
|
|
|
#include <AP_Frsky_Telem/AP_Frsky_Telem.h>
|
|
|
|
#endif
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2016-08-16 07:23:27 -03:00
|
|
|
#if ADVANCED_FAILSAFE == ENABLED
|
|
|
|
#include "afs_copter.h"
|
|
|
|
#endif
|
|
|
|
|
2018-01-18 02:49:20 -04:00
|
|
|
#if TOY_MODE_ENABLED == ENABLED
|
|
|
|
#include "toy_mode.h"
|
|
|
|
#endif
|
|
|
|
|
2018-02-10 10:23:06 -04:00
|
|
|
#if WINCH_ENABLED == ENABLED
|
|
|
|
#include <AP_WheelEncoder/AP_WheelEncoder.h>
|
|
|
|
#include <AP_Winch/AP_Winch.h>
|
|
|
|
#endif
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Local modules
|
|
|
|
#include "Parameters.h"
|
2016-07-21 09:44:09 -03:00
|
|
|
#include "avoidance_adsb.h"
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2015-10-22 12:36:14 -03:00
|
|
|
#if CONFIG_HAL_BOARD == HAL_BOARD_SITL
|
|
|
|
#include <SITL/SITL.h>
|
|
|
|
#endif
|
|
|
|
|
2016-08-16 07:23:27 -03:00
|
|
|
|
2015-10-19 15:25:33 -03:00
|
|
|
class Copter : public AP_HAL::HAL::Callbacks {
|
|
|
|
public:
|
2016-05-27 09:59:22 -03:00
|
|
|
friend class GCS_MAVLINK_Copter;
|
2017-02-13 22:14:55 -04:00
|
|
|
friend class GCS_Copter;
|
2016-07-19 19:52:56 -03:00
|
|
|
friend class AP_Rally_Copter;
|
2015-05-29 23:12:49 -03:00
|
|
|
friend class Parameters;
|
2016-08-16 07:23:27 -03:00
|
|
|
friend class ParametersG2;
|
2016-07-21 09:44:09 -03:00
|
|
|
friend class AP_Avoidance_Copter;
|
2016-08-16 07:23:27 -03:00
|
|
|
#if ADVANCED_FAILSAFE == ENABLED
|
|
|
|
friend class AP_AdvancedFailsafe_Copter;
|
|
|
|
#endif
|
2017-01-09 03:45:48 -04:00
|
|
|
friend class AP_Arming_Copter;
|
2018-01-18 02:49:20 -04:00
|
|
|
friend class ToyMode;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
Copter(void);
|
2015-10-19 15:25:33 -03:00
|
|
|
|
|
|
|
// HAL::Callbacks implementation.
|
|
|
|
void setup() override;
|
|
|
|
void loop() override;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
private:
|
2017-09-12 15:25:20 -03:00
|
|
|
static const AP_FWVersion fwver;
|
2017-08-18 19:45:02 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// key aircraft parameters passed to multiple libraries
|
|
|
|
AP_Vehicle::MultiCopter aparm;
|
|
|
|
|
|
|
|
// Global parameters are all contained within the 'g' class.
|
|
|
|
Parameters g;
|
2016-06-04 23:37:55 -03:00
|
|
|
ParametersG2 g2;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// main loop scheduler
|
2017-11-13 03:12:08 -04:00
|
|
|
AP_Scheduler scheduler{FUNCTOR_BIND_MEMBER(&Copter::fast_loop, void)};
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// AP_Notify instance
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Notify notify;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// used to detect MAVLink acks from GCS to stop compassmot
|
|
|
|
uint8_t command_ack_counter;
|
|
|
|
|
|
|
|
// primary input control channels
|
|
|
|
RC_Channel *channel_roll;
|
|
|
|
RC_Channel *channel_pitch;
|
|
|
|
RC_Channel *channel_throttle;
|
|
|
|
RC_Channel *channel_yaw;
|
|
|
|
|
|
|
|
// Dataflash
|
2016-05-05 19:10:08 -03:00
|
|
|
DataFlash_Class DataFlash;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_GPS gps;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// flight modes convenience array
|
|
|
|
AP_Int8 *flight_modes;
|
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Baro barometer;
|
|
|
|
Compass compass;
|
|
|
|
AP_InertialSensor ins;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
RangeFinder rangefinder{serial_manager, ROTATION_PITCH_270};
|
2016-05-07 04:55:40 -03:00
|
|
|
struct {
|
|
|
|
bool enabled:1;
|
|
|
|
bool alt_healthy:1; // true if we can trust the altitude from the rangefinder
|
|
|
|
int16_t alt_cm; // tilt compensated altitude (in cm) from rangefinder
|
2016-04-28 00:30:41 -03:00
|
|
|
uint32_t last_healthy_ms;
|
|
|
|
LowPassFilterFloat alt_cm_filt; // altitude filter
|
2016-11-20 02:26:51 -04:00
|
|
|
int8_t glitch_count;
|
2016-05-11 03:31:58 -03:00
|
|
|
} rangefinder_state = { false, false, 0, 0 };
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_RPM rpm_sensor;
|
2015-08-07 02:34:56 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Inertial Navigation EKF
|
2017-12-12 21:06:15 -04:00
|
|
|
NavEKF2 EKF2{&ahrs, barometer, rangefinder};
|
|
|
|
NavEKF3 EKF3{&ahrs, barometer, rangefinder};
|
2017-12-01 21:04:07 -04:00
|
|
|
AP_AHRS_NavEKF ahrs{ins, barometer, EKF2, EKF3, AP_AHRS_NavEKF::FLAG_ALWAYS_USE_EKF};
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
#if CONFIG_HAL_BOARD == HAL_BOARD_SITL
|
2015-10-22 10:04:42 -03:00
|
|
|
SITL::SITL sitl;
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// Mission library
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Mission mission{ahrs,
|
2017-08-28 18:31:45 -03:00
|
|
|
FUNCTOR_BIND_MEMBER(&Copter::start_command, bool, const AP_Mission::Mission_Command &),
|
|
|
|
FUNCTOR_BIND_MEMBER(&Copter::verify_command_callback, bool, const AP_Mission::Mission_Command &),
|
2017-12-12 21:06:15 -04:00
|
|
|
FUNCTOR_BIND_MEMBER(&Copter::exit_mission, void)};
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-12-10 22:50:49 -04:00
|
|
|
bool start_command(const AP_Mission::Mission_Command& cmd) {
|
|
|
|
return mode_auto.start_command(cmd);
|
|
|
|
}
|
|
|
|
bool verify_command_callback(const AP_Mission::Mission_Command& cmd) {
|
|
|
|
return mode_auto.verify_command_callback(cmd);
|
|
|
|
}
|
|
|
|
void exit_mission() {
|
|
|
|
mode_auto.exit_mission();
|
|
|
|
}
|
|
|
|
|
2017-01-09 03:45:48 -04:00
|
|
|
// Arming/Disarming mangement class
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Arming_Copter arming{ahrs, barometer, compass, battery, inertial_nav, ins};
|
2017-01-09 03:45:48 -04:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Optical flow sensor
|
|
|
|
#if OPTFLOW == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
OpticalFlow optflow{ahrs};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// gnd speed limit required to observe optical flow sensor limits
|
|
|
|
float ekfGndSpdLimit;
|
|
|
|
|
|
|
|
// scale factor applied to velocity controller gain to prevent optical flow noise causing excessive angle demand noise
|
|
|
|
float ekfNavVelGainScaler;
|
|
|
|
|
2015-09-24 03:57:22 -03:00
|
|
|
// system time in milliseconds of last recorded yaw reset from ekf
|
|
|
|
uint32_t ekfYawReset_ms = 0;
|
2016-10-13 03:20:16 -03:00
|
|
|
int8_t ekf_primary_core;
|
2015-09-17 19:01:27 -03:00
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_SerialManager serial_manager;
|
2017-08-28 19:03:27 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// GCS selection
|
2017-02-13 22:14:55 -04:00
|
|
|
GCS_Copter _gcs; // avoid using this; use gcs()
|
|
|
|
GCS_Copter &gcs() { return _gcs; }
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// User variables
|
|
|
|
#ifdef USERHOOK_VARIABLES
|
|
|
|
# include USERHOOK_VARIABLES
|
|
|
|
#endif
|
|
|
|
|
|
|
|
// Documentation of GLobals:
|
2016-08-24 01:28:55 -03:00
|
|
|
typedef union {
|
2015-05-29 23:12:49 -03:00
|
|
|
struct {
|
2016-01-21 21:56:10 -04:00
|
|
|
uint8_t unused1 : 1; // 0
|
|
|
|
uint8_t simple_mode : 2; // 1,2 // This is the state of simple mode : 0 = disabled ; 1 = SIMPLE ; 2 = SUPERSIMPLE
|
|
|
|
uint8_t pre_arm_rc_check : 1; // 3 // true if rc input pre-arm checks have been completed successfully
|
|
|
|
uint8_t pre_arm_check : 1; // 4 // true if all pre-arm checks (rc, accel calibration, gps lock) have been performed
|
|
|
|
uint8_t auto_armed : 1; // 5 // stops auto missions from beginning until throttle is raised
|
|
|
|
uint8_t logging_started : 1; // 6 // true if dataflash logging has started
|
|
|
|
uint8_t land_complete : 1; // 7 // true if we have detected a landing
|
|
|
|
uint8_t new_radio_frame : 1; // 8 // Set true if we have new PWM data to act on from the Radio
|
|
|
|
uint8_t usb_connected : 1; // 9 // true if APM is powered from USB connection
|
|
|
|
uint8_t rc_receiver_present : 1; // 10 // true if we have an rc receiver present (i.e. if we've ever received an update
|
|
|
|
uint8_t compass_mot : 1; // 11 // true if we are currently performing compassmot calibration
|
|
|
|
uint8_t motor_test : 1; // 12 // true if we are currently performing the motors test
|
|
|
|
uint8_t initialised : 1; // 13 // true once the init_ardupilot function has completed. Extended status to GCS is not sent until this completes
|
|
|
|
uint8_t land_complete_maybe : 1; // 14 // true if we may have landed (less strict version of land_complete)
|
|
|
|
uint8_t throttle_zero : 1; // 15 // true if the throttle stick is at zero, debounced, determines if pilot intends shut-down when not using motor interlock
|
|
|
|
uint8_t system_time_set : 1; // 16 // true if the system time has been set from the GPS
|
2017-07-25 08:41:18 -03:00
|
|
|
uint8_t gps_glitching : 1; // 17 // true if the gps is glitching
|
2016-01-21 21:56:10 -04:00
|
|
|
enum HomeState home_state : 2; // 18,19 // home status (unset, set, locked)
|
|
|
|
uint8_t using_interlock : 1; // 20 // aux switch motor interlock function is in use
|
|
|
|
uint8_t motor_emergency_stop : 1; // 21 // motor estop switch, shuts off motors when enabled
|
|
|
|
uint8_t land_repo_active : 1; // 22 // true if the pilot is overriding the landing position
|
2016-01-21 22:59:47 -04:00
|
|
|
uint8_t motor_interlock_switch : 1; // 23 // true if pilot is requesting motor interlock enable
|
|
|
|
uint8_t in_arming_delay : 1; // 24 // true while we are armed but waiting to spin motors
|
2017-05-13 03:11:04 -03:00
|
|
|
uint8_t initialised_params : 1; // 25 // true when the all parameters have been initialised. we cannot send parameters to the GCS until this is done
|
2017-06-05 04:52:31 -03:00
|
|
|
uint8_t compass_init_location : 1; // 26 // true when the compass's initial location has been set
|
2018-01-23 08:54:27 -04:00
|
|
|
uint8_t rc_override_enable : 1; // 27 // aux switch rc_override is allowed
|
2015-05-29 23:12:49 -03:00
|
|
|
};
|
|
|
|
uint32_t value;
|
2016-08-24 01:28:55 -03:00
|
|
|
} ap_t;
|
|
|
|
|
|
|
|
ap_t ap;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// This is the state of the flight control system
|
|
|
|
// There are multiple states defined such as STABILIZE, ACRO,
|
2016-01-25 17:26:20 -04:00
|
|
|
control_mode_t control_mode;
|
2016-01-25 19:40:41 -04:00
|
|
|
mode_reason_t control_mode_reason = MODE_REASON_UNKNOWN;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2016-01-26 20:08:45 -04:00
|
|
|
control_mode_t prev_control_mode;
|
|
|
|
mode_reason_t prev_control_mode_reason = MODE_REASON_UNKNOWN;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Structure used to detect changes in the flight mode control switch
|
|
|
|
struct {
|
|
|
|
int8_t debounced_switch_position; // currently used switch position
|
|
|
|
int8_t last_switch_position; // switch position in previous iteration
|
|
|
|
uint32_t last_edge_time_ms; // system time that switch position was last changed
|
|
|
|
} control_switch_state;
|
|
|
|
|
2016-08-24 01:23:17 -03:00
|
|
|
typedef struct {
|
2015-05-29 23:12:49 -03:00
|
|
|
bool running;
|
2015-10-19 21:56:49 -03:00
|
|
|
float max_speed;
|
|
|
|
float alt_delta;
|
2015-05-29 23:12:49 -03:00
|
|
|
uint32_t start_ms;
|
2016-08-24 01:23:17 -03:00
|
|
|
} takeoff_state_t;
|
|
|
|
takeoff_state_t takeoff_state;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2016-06-04 23:37:55 -03:00
|
|
|
// altitude below which we do no navigation in auto takeoff
|
|
|
|
float auto_takeoff_no_nav_alt_cm;
|
2017-08-28 21:45:00 -03:00
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
RCMapper rcmap;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2018-01-18 02:49:20 -04:00
|
|
|
// intertial nav alt when we armed
|
|
|
|
float arming_altitude_m;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// board specific config
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_BoardConfig BoardConfig;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-05-06 06:11:50 -03:00
|
|
|
#if HAL_WITH_UAVCAN
|
|
|
|
// board specific config for CAN bus
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_BoardConfig_CAN BoardConfig_CAN;
|
2017-05-06 06:11:50 -03:00
|
|
|
#endif
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// receiver RSSI
|
|
|
|
uint8_t receiver_rssi;
|
|
|
|
|
|
|
|
// Failsafe
|
|
|
|
struct {
|
|
|
|
uint8_t rc_override_active : 1; // 0 // true if rc control are overwritten by ground station
|
|
|
|
uint8_t radio : 1; // 1 // A status flag for the radio failsafe
|
|
|
|
uint8_t battery : 1; // 2 // A status flag for the battery failsafe
|
|
|
|
uint8_t gcs : 1; // 4 // A status flag for the ground station failsafe
|
|
|
|
uint8_t ekf : 1; // 5 // true if ekf failsafe has occurred
|
2016-04-22 08:37:48 -03:00
|
|
|
uint8_t terrain : 1; // 6 // true if the missing terrain data failsafe has occurred
|
2016-07-19 03:42:46 -03:00
|
|
|
uint8_t adsb : 1; // 7 // true if an adsb related failsafe has occurred
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
int8_t radio_counter; // number of iterations with throttle below throttle_fs_value
|
|
|
|
|
|
|
|
uint32_t last_heartbeat_ms; // the time when the last HEARTBEAT message arrived from a GCS - used for triggering gcs failsafe
|
2016-04-22 08:37:48 -03:00
|
|
|
uint32_t terrain_first_failure_ms; // the first time terrain data access failed - used to calculate the duration of the failure
|
|
|
|
uint32_t terrain_last_failure_ms; // the most recent time terrain data access failed
|
2015-05-29 23:12:49 -03:00
|
|
|
} failsafe;
|
|
|
|
|
2015-07-12 10:06:21 -03:00
|
|
|
// sensor health for logging
|
|
|
|
struct {
|
|
|
|
uint8_t baro : 1; // true if baro is healthy
|
|
|
|
uint8_t compass : 1; // true if compass is healthy
|
2017-03-08 20:16:25 -04:00
|
|
|
uint8_t primary_gps; // primary gps index
|
2015-07-12 10:06:21 -03:00
|
|
|
} sensor_health;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Motor Output
|
2017-01-09 03:31:26 -04:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
2017-03-14 06:47:18 -03:00
|
|
|
#define MOTOR_CLASS AP_MotorsHeli
|
2015-05-29 23:12:49 -03:00
|
|
|
#else
|
2017-01-09 03:31:26 -04:00
|
|
|
#define MOTOR_CLASS AP_MotorsMulticopter
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
2017-01-09 03:31:26 -04:00
|
|
|
MOTOR_CLASS *motors;
|
2017-03-14 06:47:18 -03:00
|
|
|
const struct AP_Param::GroupInfo *motors_var_info;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// GPS variables
|
|
|
|
// Sometimes we need to remove the scaling for distance calcs
|
|
|
|
float scaleLongDown;
|
|
|
|
|
2017-12-05 23:34:33 -04:00
|
|
|
int32_t _home_bearing;
|
|
|
|
uint32_t _home_distance;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// SIMPLE Mode
|
2017-11-27 08:07:50 -04:00
|
|
|
// Used to track the orientation of the vehicle for Simple mode. This value is reset at each arming
|
|
|
|
// or in SuperSimple mode when the vehicle leaves a 20m radius from home.
|
2015-05-29 23:12:49 -03:00
|
|
|
float simple_cos_yaw;
|
|
|
|
float simple_sin_yaw;
|
|
|
|
int32_t super_simple_last_bearing;
|
|
|
|
float super_simple_cos_yaw;
|
|
|
|
float super_simple_sin_yaw;
|
|
|
|
|
|
|
|
// Stores initial bearing when armed - initial simple bearing is modified in super simple mode so not suitable
|
|
|
|
int32_t initial_armed_bearing;
|
|
|
|
|
|
|
|
// Battery Sensors
|
2018-01-16 15:14:43 -04:00
|
|
|
AP_BattMonitor battery{MASK_LOG_CURRENT};
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
#if FRSKY_TELEM_ENABLED == ENABLED
|
2017-08-29 14:44:54 -03:00
|
|
|
// FrSky telemetry support
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Frsky_Telem frsky_telemetry{ahrs, battery, rangefinder};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
2016-09-20 16:42:24 -03:00
|
|
|
// Variables for extended status MAVLink messages
|
|
|
|
uint32_t control_sensors_present;
|
|
|
|
uint32_t control_sensors_enabled;
|
|
|
|
uint32_t control_sensors_health;
|
2017-08-29 14:44:54 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Altitude
|
|
|
|
// The cm/s we are moving up or down based on filtered data - Positive = UP
|
|
|
|
int16_t climb_rate;
|
2016-04-27 08:37:04 -03:00
|
|
|
float target_rangefinder_alt; // desired altitude in cm above the ground
|
2015-05-29 23:12:49 -03:00
|
|
|
int32_t baro_alt; // barometer altitude in cm above home
|
|
|
|
float baro_climbrate; // barometer climbrate in cm/s
|
2015-06-17 08:37:15 -03:00
|
|
|
LowPassFilterVector3f land_accel_ef_filter; // accelerations for land and crash detector tests
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2016-01-14 01:47:26 -04:00
|
|
|
// filtered pilot's throttle input used to cancel landing if throttle held high
|
2016-01-06 17:39:36 -04:00
|
|
|
LowPassFilterFloat rc_throttle_control_in_filter;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// 3D Location vectors
|
2017-11-27 08:07:50 -04:00
|
|
|
// Current location of the vehicle (altitude is relative to home)
|
2015-08-13 22:12:10 -03:00
|
|
|
Location_Class current_loc;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// Navigation Yaw control
|
|
|
|
// auto flight mode's yaw mode
|
|
|
|
uint8_t auto_yaw_mode;
|
|
|
|
|
|
|
|
// Yaw will point at this location if auto_yaw_mode is set to AUTO_YAW_ROI
|
|
|
|
Vector3f roi_WP;
|
|
|
|
|
|
|
|
// bearing from current location to the yaw_look_at_WP
|
|
|
|
float yaw_look_at_WP_bearing;
|
|
|
|
|
|
|
|
// yaw used for YAW_LOOK_AT_HEADING yaw_mode
|
|
|
|
int32_t yaw_look_at_heading;
|
|
|
|
|
|
|
|
// Deg/s we should turn
|
|
|
|
int16_t yaw_look_at_heading_slew;
|
|
|
|
|
|
|
|
// heading when in yaw_look_ahead_bearing
|
|
|
|
float yaw_look_ahead_bearing;
|
|
|
|
|
2017-07-10 09:51:43 -03:00
|
|
|
// turn rate (in cds) when auto_yaw_mode is set to AUTO_YAW_RATE
|
|
|
|
float auto_yaw_rate_cds;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// IMU variables
|
|
|
|
// Integration time (in seconds) for the gyros (DCM algorithm)
|
|
|
|
// Updated with the fast loop
|
|
|
|
float G_Dt;
|
|
|
|
|
|
|
|
// Inertial Navigation
|
|
|
|
AP_InertialNav_NavEKF inertial_nav;
|
|
|
|
|
|
|
|
// Attitude, Position and Waypoint navigation objects
|
|
|
|
// To-Do: move inertial nav up or other navigation variables down here
|
2016-03-21 01:33:42 -03:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
|
|
|
#define AC_AttitudeControl_t AC_AttitudeControl_Heli
|
|
|
|
#else
|
|
|
|
#define AC_AttitudeControl_t AC_AttitudeControl_Multi
|
|
|
|
#endif
|
|
|
|
AC_AttitudeControl_t *attitude_control;
|
2017-01-09 03:31:26 -04:00
|
|
|
AC_PosControl *pos_control;
|
|
|
|
AC_WPNav *wp_nav;
|
|
|
|
AC_Circle *circle_nav;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// System Timers
|
|
|
|
// --------------
|
2016-01-21 22:59:47 -04:00
|
|
|
// arm_time_ms - Records when vehicle was armed. Will be Zero if we are disarmed.
|
|
|
|
uint32_t arm_time_ms;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// Used to exit the roll and pitch auto trim function
|
|
|
|
uint8_t auto_trim_counter;
|
|
|
|
|
|
|
|
// Reference to the relay object
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Relay relay;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// handle repeated servo and relay events
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_ServoRelayEvents ServoRelayEvents{relay};
|
2015-05-29 23:12:49 -03:00
|
|
|
|
2017-08-29 15:49:08 -03:00
|
|
|
// Camera
|
2015-05-29 23:12:49 -03:00
|
|
|
#if CAMERA == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Camera camera{&relay, MASK_LOG_CAMERA, current_loc, ahrs};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// Camera/Antenna mount tracking and stabilisation stuff
|
|
|
|
#if MOUNT == ENABLED
|
|
|
|
// current_loc uses the baro/gps soloution for altitude rather than gps only.
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Mount camera_mount{ahrs, current_loc};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// AC_Fence library to reduce fly-aways
|
|
|
|
#if AC_FENCE == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AC_Fence fence{ahrs};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
2017-08-29 20:06:26 -03:00
|
|
|
|
2017-01-02 20:36:26 -04:00
|
|
|
#if AC_AVOID_ENABLED == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AC_Avoid avoid{ahrs, fence, g2.proximity, &g2.beacon};
|
2017-01-02 20:36:26 -04:00
|
|
|
#endif
|
2017-08-29 20:28:35 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Rally library
|
|
|
|
#if AC_RALLY == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Rally_Copter rally{ahrs};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
2017-08-29 20:48:30 -03:00
|
|
|
// RSSI
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_RSSI rssi;
|
2015-08-28 03:00:55 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Crop Sprayer
|
|
|
|
#if SPRAYER == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AC_Sprayer sprayer{&inertial_nav};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// Parachute release
|
|
|
|
#if PARACHUTE == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Parachute parachute{relay};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
|
|
|
// Landing Gear Controller
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_LandingGear landinggear;
|
2015-05-29 23:12:49 -03:00
|
|
|
|
|
|
|
// terrain handling
|
2015-11-13 23:38:47 -04:00
|
|
|
#if AP_TERRAIN_AVAILABLE && AC_TERRAIN
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Terrain terrain{ahrs, mission, rally};
|
2015-05-29 23:12:49 -03:00
|
|
|
#endif
|
|
|
|
|
2015-02-16 00:39:18 -04:00
|
|
|
// Precision Landing
|
|
|
|
#if PRECISION_LANDING == ENABLED
|
2017-12-12 21:06:15 -04:00
|
|
|
AC_PrecLand precland{ahrs, inertial_nav};
|
2015-02-16 00:39:18 -04:00
|
|
|
#endif
|
|
|
|
|
2015-10-12 11:27:26 -03:00
|
|
|
// Pilot Input Management Library
|
2017-08-29 21:18:40 -03:00
|
|
|
// Only used for Helicopter for now
|
2015-10-12 11:27:26 -03:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
2017-12-12 21:06:15 -04:00
|
|
|
AC_InputManager_Heli input_manager;
|
2015-10-12 11:27:26 -03:00
|
|
|
#endif
|
|
|
|
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_ADSB adsb{ahrs};
|
2015-11-25 19:22:21 -04:00
|
|
|
|
2017-11-27 08:07:50 -04:00
|
|
|
// avoidance of adsb enabled vehicles (normally manned vehicles)
|
2017-12-12 21:06:15 -04:00
|
|
|
AP_Avoidance_Copter avoidance_adsb{ahrs, adsb};
|
2016-07-21 09:44:09 -03:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// use this to prevent recursion during sensor init
|
|
|
|
bool in_mavlink_delay;
|
|
|
|
|
2016-08-16 07:23:27 -03:00
|
|
|
// last valid RC input time
|
|
|
|
uint32_t last_radio_update_ms;
|
2017-03-01 07:18:11 -04:00
|
|
|
|
2017-05-09 03:57:40 -03:00
|
|
|
// last esc calibration notification update
|
|
|
|
uint32_t esc_calibration_notify_update_ms;
|
|
|
|
|
2017-03-01 07:18:11 -04:00
|
|
|
#if VISUAL_ODOMETRY_ENABLED == ENABLED
|
|
|
|
// last visual odometry update time
|
|
|
|
uint32_t visual_odom_last_update_ms;
|
|
|
|
#endif
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
// Top-level logic
|
|
|
|
// setup the var_info table
|
|
|
|
AP_Param param_loader;
|
|
|
|
|
2015-05-31 19:10:30 -03:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
|
|
|
// Mode filter to reject RC Input glitches. Filter size is 5, and it draws the 4th element, so it can reject 3 low glitches,
|
|
|
|
// and 1 high glitch. This is because any "off" glitches can be highly problematic for a helicopter running an ESC
|
|
|
|
// governor. Even a single "off" frame can cause the rotor to slow dramatically and take a long time to restart.
|
|
|
|
ModeFilterInt16_Size5 rotor_speed_deglitch_filter {4};
|
|
|
|
|
|
|
|
// Tradheli flags
|
2017-11-09 21:09:27 -04:00
|
|
|
typedef struct {
|
2015-05-31 19:10:30 -03:00
|
|
|
uint8_t dynamic_flight : 1; // 0 // true if we are moving at a significant speed (used to turn on/off leaky I terms)
|
|
|
|
uint8_t init_targets_on_arming : 1; // 1 // true if we have been disarmed, and need to reset rate controller targets when we arm
|
2017-08-27 20:51:49 -03:00
|
|
|
uint8_t inverted_flight : 1; // 2 // true for inverted flight mode
|
2017-11-09 21:09:27 -04:00
|
|
|
} heli_flags_t;
|
|
|
|
heli_flags_t heli_flags;
|
2016-06-04 23:37:55 -03:00
|
|
|
|
|
|
|
int16_t hover_roll_trim_scalar_slew;
|
2015-05-31 19:10:30 -03:00
|
|
|
#endif
|
|
|
|
|
2015-12-22 15:27:24 -04:00
|
|
|
// ground effect detector
|
|
|
|
struct {
|
|
|
|
bool takeoff_expected;
|
|
|
|
bool touchdown_expected;
|
|
|
|
uint32_t takeoff_time_ms;
|
|
|
|
float takeoff_alt_cm;
|
|
|
|
} gndeffect_state;
|
|
|
|
|
2017-01-10 02:48:51 -04:00
|
|
|
// set when we are upgrading parameters from 3.4
|
|
|
|
bool upgrading_frame_params;
|
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
static const AP_Scheduler::Task scheduler_tasks[];
|
|
|
|
static const AP_Param::Info var_info[];
|
|
|
|
static const struct LogStructure log_structure[];
|
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
// AP_State.cpp
|
|
|
|
void set_home_state(enum HomeState new_home_state);
|
|
|
|
bool home_is_set();
|
|
|
|
void set_auto_armed(bool b);
|
|
|
|
void set_simple_mode(uint8_t b);
|
|
|
|
void set_failsafe_radio(bool b);
|
|
|
|
void set_failsafe_battery(bool b);
|
|
|
|
void set_failsafe_gcs(bool b);
|
|
|
|
void update_using_interlock();
|
|
|
|
void set_motor_emergency_stop(bool b);
|
|
|
|
|
|
|
|
// ArduCopter.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void fast_loop();
|
|
|
|
void rc_loop();
|
|
|
|
void throttle_loop();
|
|
|
|
void update_batt_compass(void);
|
2017-05-23 02:30:57 -03:00
|
|
|
void fourhundred_hz_logging();
|
2015-05-29 23:12:49 -03:00
|
|
|
void ten_hz_logging_loop();
|
2016-05-03 00:21:23 -03:00
|
|
|
void twentyfive_hz_logging();
|
2015-05-29 23:12:49 -03:00
|
|
|
void three_hz_loop();
|
|
|
|
void one_hz_loop();
|
|
|
|
void update_GPS(void);
|
|
|
|
void init_simple_bearing();
|
|
|
|
void update_simple_mode(void);
|
|
|
|
void update_super_simple_bearing(bool force_update);
|
|
|
|
void read_AHRS(void);
|
|
|
|
void update_altitude();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// Attitude.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
float get_smoothing_gain();
|
2015-09-06 09:23:30 -03:00
|
|
|
void get_pilot_desired_lean_angles(float roll_in, float pitch_in, float &roll_out, float &pitch_out, float angle_max);
|
2015-05-29 23:12:49 -03:00
|
|
|
float get_pilot_desired_yaw_rate(int16_t stick_angle);
|
|
|
|
float get_roi_yaw();
|
|
|
|
float get_look_ahead_yaw();
|
2016-06-09 09:42:15 -03:00
|
|
|
void update_throttle_hover();
|
2015-05-29 23:12:49 -03:00
|
|
|
void set_throttle_takeoff();
|
2016-10-14 02:49:11 -03:00
|
|
|
float get_pilot_desired_throttle(int16_t throttle_control, float thr_mid = 0.0f);
|
2015-05-29 23:12:49 -03:00
|
|
|
float get_pilot_desired_climb_rate(float throttle_control);
|
|
|
|
float get_non_takeoff_throttle();
|
|
|
|
float get_surface_tracking_climb_rate(int16_t target_rate, float current_alt_target, float dt);
|
2017-01-05 02:32:01 -04:00
|
|
|
float get_avoidance_adjusted_climbrate(float target_rate);
|
2016-10-14 03:34:24 -03:00
|
|
|
void set_accel_throttle_I_from_pilot_throttle();
|
2015-08-11 08:25:20 -03:00
|
|
|
void rotate_body_frame_to_NE(float &x, float &y);
|
2017-12-14 07:40:46 -04:00
|
|
|
uint16_t get_pilot_speed_dn();
|
|
|
|
|
|
|
|
// avoidance_adsb.cpp
|
|
|
|
void avoidance_adsb_update(void);
|
|
|
|
|
|
|
|
// baro_ground_effect.cpp
|
|
|
|
void update_ground_effect_detector(void);
|
|
|
|
|
|
|
|
// capabilities.cpp
|
|
|
|
void init_capabilities(void);
|
|
|
|
|
|
|
|
// commands.cpp
|
|
|
|
void update_home_from_EKF();
|
|
|
|
void set_home_to_current_location_inflight();
|
|
|
|
bool set_home_to_current_location(bool lock);
|
|
|
|
bool set_home(const Location& loc, bool lock);
|
|
|
|
void set_ekf_origin(const Location& loc);
|
|
|
|
bool far_from_EKF_origin(const Location& loc);
|
|
|
|
void set_system_time_from_GPS();
|
|
|
|
|
|
|
|
// compassmot.cpp
|
|
|
|
MAV_RESULT mavlink_compassmot(mavlink_channel_t chan);
|
|
|
|
|
|
|
|
// compat.cpp
|
|
|
|
void delay(uint32_t ms);
|
|
|
|
|
|
|
|
// crash_check.cpp
|
|
|
|
void crash_check();
|
|
|
|
void parachute_check();
|
|
|
|
void parachute_release();
|
|
|
|
void parachute_manual_release();
|
|
|
|
|
|
|
|
// ekf_check.cpp
|
|
|
|
void ekf_check();
|
|
|
|
bool ekf_check_position_problem();
|
|
|
|
bool ekf_over_threshold();
|
|
|
|
void failsafe_ekf_event();
|
|
|
|
void failsafe_ekf_off_event(void);
|
|
|
|
void check_ekf_reset();
|
|
|
|
|
|
|
|
// esc_calibration.cpp
|
|
|
|
void esc_calibration_startup_check();
|
|
|
|
void esc_calibration_passthrough();
|
|
|
|
void esc_calibration_auto();
|
|
|
|
void esc_calibration_notify();
|
|
|
|
|
|
|
|
// events.cpp
|
|
|
|
void failsafe_radio_on_event();
|
|
|
|
void failsafe_radio_off_event();
|
|
|
|
void failsafe_battery_event(void);
|
|
|
|
void failsafe_gcs_check();
|
|
|
|
void failsafe_gcs_off_event(void);
|
|
|
|
void failsafe_terrain_check();
|
|
|
|
void failsafe_terrain_set_status(bool data_ok);
|
|
|
|
void failsafe_terrain_on_event();
|
|
|
|
void gpsglitch_check();
|
|
|
|
void set_mode_RTL_or_land_with_pause(mode_reason_t reason);
|
2018-01-19 09:44:02 -04:00
|
|
|
void set_mode_SmartRTL_or_RTL(mode_reason_t reason);
|
|
|
|
void set_mode_SmartRTL_or_land_with_pause(mode_reason_t reason);
|
2017-12-14 07:40:46 -04:00
|
|
|
bool should_disarm_on_failsafe();
|
|
|
|
void update_events();
|
|
|
|
|
|
|
|
// failsafe.cpp
|
|
|
|
void failsafe_enable();
|
|
|
|
void failsafe_disable();
|
|
|
|
#if ADVANCED_FAILSAFE == ENABLED
|
|
|
|
void afs_fs_check(void);
|
|
|
|
#endif
|
|
|
|
|
|
|
|
// fence.cpp
|
|
|
|
void fence_check();
|
|
|
|
void fence_send_mavlink_status(mavlink_channel_t chan);
|
|
|
|
|
|
|
|
// GCS_Mavlink.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void gcs_send_heartbeat(void);
|
|
|
|
void gcs_send_deferred(void);
|
|
|
|
void send_heartbeat(mavlink_channel_t chan);
|
|
|
|
void send_attitude(mavlink_channel_t chan);
|
2017-01-11 21:50:32 -04:00
|
|
|
void send_fence_status(mavlink_channel_t chan);
|
2015-05-29 23:12:49 -03:00
|
|
|
void send_extended_status1(mavlink_channel_t chan);
|
|
|
|
void send_location(mavlink_channel_t chan);
|
|
|
|
void send_nav_controller_output(mavlink_channel_t chan);
|
|
|
|
void send_simstate(mavlink_channel_t chan);
|
|
|
|
void send_vfr_hud(mavlink_channel_t chan);
|
2015-08-07 02:34:56 -03:00
|
|
|
void send_rpm(mavlink_channel_t chan);
|
2015-05-29 23:12:49 -03:00
|
|
|
void send_pid_tuning(mavlink_channel_t chan);
|
|
|
|
void gcs_data_stream_send(void);
|
|
|
|
void gcs_check_input(void);
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// heli.cpp
|
|
|
|
void heli_init();
|
|
|
|
void check_dynamic_flight(void);
|
|
|
|
void update_heli_control_dynamics(void);
|
|
|
|
void heli_update_landing_swash();
|
|
|
|
void heli_update_rotor_speed_targets();
|
|
|
|
|
|
|
|
// inertia.cpp
|
|
|
|
void read_inertia();
|
|
|
|
|
|
|
|
// landing_detector.cpp
|
|
|
|
void update_land_and_crash_detectors();
|
|
|
|
void update_land_detector();
|
|
|
|
void set_land_complete(bool b);
|
|
|
|
void set_land_complete_maybe(bool b);
|
|
|
|
void update_throttle_thr_mix();
|
|
|
|
|
|
|
|
// landing_gear.cpp
|
|
|
|
void landinggear_update();
|
|
|
|
|
|
|
|
// Log.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void Log_Write_Optflow();
|
|
|
|
void Log_Write_Nav_Tuning();
|
|
|
|
void Log_Write_Control_Tuning();
|
|
|
|
void Log_Write_Performance();
|
|
|
|
void Log_Write_Attitude();
|
2017-05-23 02:30:57 -03:00
|
|
|
void Log_Write_EKF_POS();
|
2015-05-29 23:12:49 -03:00
|
|
|
void Log_Write_MotBatt();
|
|
|
|
void Log_Write_Event(uint8_t id);
|
|
|
|
void Log_Write_Data(uint8_t id, int32_t value);
|
|
|
|
void Log_Write_Data(uint8_t id, uint32_t value);
|
|
|
|
void Log_Write_Data(uint8_t id, int16_t value);
|
|
|
|
void Log_Write_Data(uint8_t id, uint16_t value);
|
|
|
|
void Log_Write_Data(uint8_t id, float value);
|
|
|
|
void Log_Write_Error(uint8_t sub_system, uint8_t error_code);
|
|
|
|
void Log_Write_Baro(void);
|
|
|
|
void Log_Write_Parameter_Tuning(uint8_t param, float tuning_val, int16_t control_in, int16_t tune_low, int16_t tune_high);
|
2015-07-05 05:25:28 -03:00
|
|
|
void Log_Write_Home_And_Origin();
|
2015-07-12 10:06:21 -03:00
|
|
|
void Log_Sensor_Health();
|
2015-06-18 18:09:39 -03:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
|
|
|
void Log_Write_Heli(void);
|
|
|
|
#endif
|
2015-08-28 05:14:02 -03:00
|
|
|
void Log_Write_Precland();
|
2016-01-10 22:41:28 -04:00
|
|
|
void Log_Write_GuidedTarget(uint8_t target_type, const Vector3f& pos_target, const Vector3f& vel_target);
|
2016-08-02 02:41:39 -03:00
|
|
|
void Log_Write_Throw(ThrowModeStage stage, float velocity, float velocity_z, float accel, float ef_accel_z, bool throw_detect, bool attitude_ok, bool height_ok, bool position_ok);
|
2016-08-16 09:09:17 -03:00
|
|
|
void Log_Write_Proximity();
|
2016-10-27 01:40:55 -03:00
|
|
|
void Log_Write_Beacon();
|
2015-08-06 09:18:39 -03:00
|
|
|
void Log_Write_Vehicle_Startup_Messages();
|
2017-12-14 07:40:46 -04:00
|
|
|
void log_init(void);
|
|
|
|
|
|
|
|
// mode.cpp
|
|
|
|
bool set_mode(control_mode_t mode, mode_reason_t reason);
|
|
|
|
void update_flight_mode();
|
|
|
|
void notify_flight_mode();
|
|
|
|
|
|
|
|
// mode_auto.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
uint8_t get_default_auto_yaw_mode(bool rtl);
|
|
|
|
void set_auto_yaw_mode(uint8_t yaw_mode);
|
2017-07-11 02:04:58 -03:00
|
|
|
void set_auto_yaw_look_at_heading(float angle_deg, float turn_rate_dps, int8_t direction, bool relative_angle);
|
2015-05-29 23:12:49 -03:00
|
|
|
void set_auto_yaw_roi(const Location &roi_location);
|
2017-07-10 09:51:43 -03:00
|
|
|
void set_auto_yaw_rate(float turn_rate_cds);
|
2015-05-29 23:12:49 -03:00
|
|
|
float get_auto_heading(void);
|
2017-07-10 09:51:43 -03:00
|
|
|
float get_auto_yaw_rate_cds();
|
2017-02-07 20:35:31 -04:00
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
// mode_land.cpp
|
2016-07-07 21:41:38 -03:00
|
|
|
void land_run_vertical_control(bool pause_descent = false);
|
|
|
|
void land_run_horizontal_control();
|
2016-01-25 19:40:41 -04:00
|
|
|
void set_mode_land_with_pause(mode_reason_t reason);
|
2015-05-29 23:12:49 -03:00
|
|
|
bool landing_with_GPS();
|
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
// motor_test.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void motor_test_output();
|
|
|
|
bool mavlink_motor_test_check(mavlink_channel_t chan, bool check_rc);
|
2017-11-27 02:16:41 -04:00
|
|
|
MAV_RESULT mavlink_motor_test_start(mavlink_channel_t chan, uint8_t motor_seq, uint8_t throttle_type, uint16_t throttle_value, float timeout_sec, uint8_t motor_count);
|
2015-05-29 23:12:49 -03:00
|
|
|
void motor_test_stop();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// motors.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void arm_motors_check();
|
|
|
|
void auto_disarm_check();
|
|
|
|
bool init_arm_motors(bool arming_from_gcs);
|
|
|
|
void init_disarm_motors();
|
|
|
|
void motors_output();
|
|
|
|
void lost_vehicle_check();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// navigation.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void run_nav_updates(void);
|
2017-12-14 07:40:46 -04:00
|
|
|
int32_t home_bearing();
|
|
|
|
uint32_t home_distance();
|
|
|
|
|
|
|
|
// Parameters.cpp
|
|
|
|
void load_parameters(void);
|
|
|
|
void convert_pid_parameters(void);
|
|
|
|
|
|
|
|
// position_vector.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
Vector3f pv_location_to_vector(const Location& loc);
|
|
|
|
float pv_alt_above_origin(float alt_above_home_cm);
|
|
|
|
float pv_alt_above_home(float alt_above_origin_cm);
|
2016-05-19 05:35:44 -03:00
|
|
|
float pv_distance_to_home_cm(const Vector3f &destination);
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// precision_landing.cpp
|
|
|
|
void init_precland();
|
|
|
|
void update_precland();
|
|
|
|
|
|
|
|
// radio.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void default_dead_zones();
|
|
|
|
void init_rc_in();
|
|
|
|
void init_rc_out();
|
|
|
|
void enable_motor_output();
|
|
|
|
void read_radio();
|
|
|
|
void set_throttle_and_failsafe(uint16_t throttle_pwm);
|
|
|
|
void set_throttle_zero_flag(int16_t throttle_control);
|
2016-02-05 21:43:16 -04:00
|
|
|
void radio_passthrough_to_motors();
|
2018-01-18 02:49:20 -04:00
|
|
|
int16_t get_throttle_mid(void);
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// sensors.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void init_barometer(bool full_calibration);
|
|
|
|
void read_barometer(void);
|
2016-04-27 08:37:04 -03:00
|
|
|
void init_rangefinder(void);
|
2016-04-27 09:20:03 -03:00
|
|
|
void read_rangefinder(void);
|
2016-04-27 09:18:35 -03:00
|
|
|
bool rangefinder_alt_ok();
|
2017-12-14 07:40:46 -04:00
|
|
|
void rpm_update();
|
2015-05-29 23:12:49 -03:00
|
|
|
void init_compass();
|
2017-12-14 07:40:46 -04:00
|
|
|
void compass_accumulate(void);
|
2015-05-29 23:12:49 -03:00
|
|
|
void init_optflow();
|
|
|
|
void update_optical_flow(void);
|
|
|
|
void read_battery(void);
|
|
|
|
void read_receiver_rssi(void);
|
2017-12-14 07:40:46 -04:00
|
|
|
void compass_cal_update(void);
|
|
|
|
void accel_cal_update(void);
|
|
|
|
void init_proximity();
|
|
|
|
void update_proximity();
|
|
|
|
void update_sensor_status_flags(void);
|
|
|
|
void init_beacon();
|
|
|
|
void init_visual_odom();
|
|
|
|
void update_visual_odom();
|
2017-10-04 23:21:23 -03:00
|
|
|
void winch_init();
|
|
|
|
void winch_update();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// setup.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void report_compass();
|
|
|
|
void print_blanks(int16_t num);
|
|
|
|
void print_divider(void);
|
|
|
|
void print_enabled(bool b);
|
|
|
|
void report_version();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// switches.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void read_control_switch();
|
|
|
|
bool check_if_auxsw_mode_used(uint8_t auxsw_mode_check);
|
|
|
|
bool check_duplicate_auxsw(void);
|
|
|
|
void reset_control_switch();
|
2017-01-06 21:06:40 -04:00
|
|
|
uint8_t read_3pos_switch(uint8_t chan);
|
2015-05-29 23:12:49 -03:00
|
|
|
void read_aux_switches();
|
|
|
|
void init_aux_switches();
|
|
|
|
void init_aux_switch_function(int8_t ch_option, uint8_t ch_flag);
|
|
|
|
void do_aux_switch_function(int8_t ch_function, uint8_t ch_flag);
|
|
|
|
void save_trim();
|
|
|
|
void auto_trim();
|
2017-12-14 07:40:46 -04:00
|
|
|
|
|
|
|
// system.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void init_ardupilot();
|
2015-09-17 03:44:14 -03:00
|
|
|
void startup_INS_ground();
|
|
|
|
bool calibrate_gyros();
|
2015-05-29 23:12:49 -03:00
|
|
|
bool position_ok();
|
2015-06-15 03:53:41 -03:00
|
|
|
bool ekf_position_ok();
|
2015-05-29 23:12:49 -03:00
|
|
|
bool optflow_position_ok();
|
|
|
|
void update_auto_armed();
|
|
|
|
void check_usb_mux(void);
|
|
|
|
bool should_log(uint32_t mask);
|
2016-12-13 22:30:13 -04:00
|
|
|
void set_default_frame_class();
|
2016-12-12 06:22:56 -04:00
|
|
|
uint8_t get_frame_mav_type();
|
|
|
|
const char* get_frame_string();
|
2017-12-14 07:40:46 -04:00
|
|
|
void allocate_motors(void);
|
|
|
|
|
|
|
|
// takeoff.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
bool current_mode_has_user_takeoff(bool must_navigate);
|
|
|
|
bool do_user_takeoff(float takeoff_alt_cm, bool must_navigate);
|
2015-06-21 23:59:43 -03:00
|
|
|
void takeoff_timer_start(float alt_cm);
|
2015-05-29 23:12:49 -03:00
|
|
|
void takeoff_stop();
|
|
|
|
void takeoff_get_climb_rates(float& pilot_climb_rate, float& takeoff_climb_rate);
|
2017-12-14 07:40:46 -04:00
|
|
|
void auto_takeoff_set_start_alt(void);
|
|
|
|
void auto_takeoff_attitude_run(float target_yaw_rate);
|
|
|
|
|
|
|
|
// terrain.cpp
|
|
|
|
void terrain_update();
|
|
|
|
void terrain_logging();
|
|
|
|
bool terrain_use();
|
|
|
|
|
|
|
|
// tuning.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
void tuning();
|
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
// UserCode.cpp
|
|
|
|
void userhook_init();
|
|
|
|
void userhook_FastLoop();
|
|
|
|
void userhook_50Hz();
|
|
|
|
void userhook_MediumLoop();
|
|
|
|
void userhook_SlowLoop();
|
|
|
|
void userhook_SuperSlowLoop();
|
2016-03-21 01:33:42 -03:00
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
#include "mode.h"
|
2016-03-21 01:33:42 -03:00
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
Mode *flightmode;
|
2016-03-21 01:20:54 -03:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeAcro_Heli mode_acro;
|
2016-03-21 01:20:54 -03:00
|
|
|
#else
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeAcro mode_acro;
|
2016-03-21 01:20:54 -03:00
|
|
|
#endif
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeAltHold mode_althold;
|
|
|
|
ModeAuto mode_auto;
|
2016-03-22 20:36:52 -03:00
|
|
|
#if AUTOTUNE_ENABLED == ENABLED
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeAutoTune mode_autotune;
|
|
|
|
#endif
|
|
|
|
ModeBrake mode_brake;
|
|
|
|
ModeCircle mode_circle;
|
|
|
|
ModeDrift mode_drift;
|
|
|
|
ModeFlip mode_flip;
|
|
|
|
ModeGuided mode_guided;
|
|
|
|
ModeLand mode_land;
|
|
|
|
ModeLoiter mode_loiter;
|
|
|
|
ModePosHold mode_poshold;
|
|
|
|
ModeRTL mode_rtl;
|
2017-01-14 01:23:33 -04:00
|
|
|
#if FRAME_CONFIG == HELI_FRAME
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeStabilize_Heli mode_stabilize;
|
2017-01-14 01:23:33 -04:00
|
|
|
#else
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeStabilize mode_stabilize;
|
2017-01-14 01:23:33 -04:00
|
|
|
#endif
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeSport mode_sport;
|
|
|
|
ModeAvoidADSB mode_avoid_adsb;
|
|
|
|
ModeThrow mode_throw;
|
|
|
|
ModeGuidedNoGPS mode_guided_nogps;
|
|
|
|
ModeSmartRTL mode_smartrtl;
|
2018-02-11 23:26:09 -04:00
|
|
|
#if !HAL_MINIMIZE_FEATURES && OPTFLOW == ENABLED
|
2018-02-07 22:21:09 -04:00
|
|
|
ModeFlowHold mode_flowhold;
|
2018-01-18 02:12:29 -04:00
|
|
|
#endif
|
2017-01-14 01:23:33 -04:00
|
|
|
|
2017-12-14 07:40:46 -04:00
|
|
|
// mode.cpp
|
|
|
|
Mode *mode_from_mode_num(const uint8_t mode);
|
2017-12-10 23:51:13 -04:00
|
|
|
void exit_mode(Mode *&old_flightmode, Mode *&new_flightmode);
|
2017-12-05 19:52:54 -04:00
|
|
|
|
2015-05-29 23:12:49 -03:00
|
|
|
public:
|
2017-12-14 07:40:46 -04:00
|
|
|
void mavlink_delay_cb(); // GCS_Mavlink.cpp
|
|
|
|
void failsafe_check(); // failsafe.cpp
|
2015-05-29 23:12:49 -03:00
|
|
|
};
|
|
|
|
|
|
|
|
extern const AP_HAL::HAL& hal;
|
|
|
|
extern Copter copter;
|
2015-08-24 03:26:17 -03:00
|
|
|
|
2015-11-19 23:04:45 -04:00
|
|
|
using AP_HAL::millis;
|
|
|
|
using AP_HAL::micros;
|