2015-08-28 05:11:52 -03:00
|
|
|
#include <AP_HAL/AP_HAL.h>
|
2018-09-19 00:34:47 -03:00
|
|
|
#include <AP_Scheduler/AP_Scheduler.h>
|
2018-08-03 07:52:48 -03:00
|
|
|
#include <AP_AHRS/AP_AHRS.h>
|
2015-08-28 05:11:52 -03:00
|
|
|
#include "AC_PrecLand.h"
|
|
|
|
#include "AC_PrecLand_Backend.h"
|
|
|
|
#include "AC_PrecLand_Companion.h"
|
|
|
|
#include "AC_PrecLand_IRLock.h"
|
2016-11-10 07:41:17 -04:00
|
|
|
#include "AC_PrecLand_SITL_Gazebo.h"
|
2016-11-11 01:10:35 -04:00
|
|
|
#include "AC_PrecLand_SITL.h"
|
2015-02-16 00:37:13 -04:00
|
|
|
|
2019-02-14 02:40:26 -04:00
|
|
|
#include <AP_AHRS/AP_AHRS.h>
|
|
|
|
|
2015-02-16 00:37:13 -04:00
|
|
|
extern const AP_HAL::HAL& hal;
|
|
|
|
|
2021-06-05 06:31:44 -03:00
|
|
|
static const uint32_t EKF_INIT_TIME_MS = 2000; // EKF initialisation requires this many milliseconds of good sensor data
|
|
|
|
static const uint32_t EKF_INIT_SENSOR_MIN_UPDATE_MS = 500; // Sensor must update within this many ms during EKF init, else init will fail
|
|
|
|
static const uint32_t LANDING_TARGET_TIMEOUT_MS = 2000; // Sensor must update within this many ms, else prec landing will be switched off
|
|
|
|
|
2015-10-25 14:03:46 -03:00
|
|
|
const AP_Param::GroupInfo AC_PrecLand::var_info[] = {
|
2016-01-07 04:35:18 -04:00
|
|
|
// @Param: ENABLED
|
2021-04-14 00:12:31 -03:00
|
|
|
// @DisplayName: Precision Land enabled/disabled
|
|
|
|
// @Description: Precision Land enabled/disabled
|
2019-01-14 21:25:28 -04:00
|
|
|
// @Values: 0:Disabled, 1:Enabled
|
2015-02-16 00:37:13 -04:00
|
|
|
// @User: Advanced
|
2016-08-04 15:29:45 -03:00
|
|
|
AP_GROUPINFO_FLAGS("ENABLED", 0, AC_PrecLand, _enabled, 0, AP_PARAM_FLAG_ENABLE),
|
2015-02-16 00:37:13 -04:00
|
|
|
|
|
|
|
// @Param: TYPE
|
|
|
|
// @DisplayName: Precision Land Type
|
|
|
|
// @Description: Precision Land Type
|
2016-11-11 01:10:35 -04:00
|
|
|
// @Values: 0:None, 1:CompanionComputer, 2:IRLock, 3:SITL_Gazebo, 4:SITL
|
2015-02-16 00:37:13 -04:00
|
|
|
// @User: Advanced
|
|
|
|
AP_GROUPINFO("TYPE", 1, AC_PrecLand, _type, 0),
|
|
|
|
|
2016-07-15 14:30:21 -03:00
|
|
|
// @Param: YAW_ALIGN
|
|
|
|
// @DisplayName: Sensor yaw alignment
|
|
|
|
// @Description: Yaw angle from body x-axis to sensor x-axis.
|
2021-05-20 10:23:39 -03:00
|
|
|
// @Range: 0 36000
|
|
|
|
// @Increment: 10
|
2016-07-15 14:30:21 -03:00
|
|
|
// @User: Advanced
|
2017-05-02 10:38:42 -03:00
|
|
|
// @Units: cdeg
|
2016-07-15 14:30:21 -03:00
|
|
|
AP_GROUPINFO("YAW_ALIGN", 2, AC_PrecLand, _yaw_align, 0),
|
|
|
|
|
|
|
|
// @Param: LAND_OFS_X
|
|
|
|
// @DisplayName: Land offset forward
|
|
|
|
// @Description: Desired landing position of the camera forward of the target in vehicle body frame
|
|
|
|
// @Range: -20 20
|
|
|
|
// @Increment: 1
|
|
|
|
// @User: Advanced
|
2017-05-02 10:38:42 -03:00
|
|
|
// @Units: cm
|
2016-07-15 14:30:21 -03:00
|
|
|
AP_GROUPINFO("LAND_OFS_X", 3, AC_PrecLand, _land_ofs_cm_x, 0),
|
|
|
|
|
|
|
|
// @Param: LAND_OFS_Y
|
|
|
|
// @DisplayName: Land offset right
|
|
|
|
// @Description: desired landing position of the camera right of the target in vehicle body frame
|
|
|
|
// @Range: -20 20
|
|
|
|
// @Increment: 1
|
|
|
|
// @User: Advanced
|
2017-05-02 10:38:42 -03:00
|
|
|
// @Units: cm
|
2016-07-15 14:30:21 -03:00
|
|
|
AP_GROUPINFO("LAND_OFS_Y", 4, AC_PrecLand, _land_ofs_cm_y, 0),
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
// @Param: EST_TYPE
|
|
|
|
// @DisplayName: Precision Land Estimator Type
|
2017-03-16 05:01:16 -03:00
|
|
|
// @Description: Specifies the estimation method to be used
|
|
|
|
// @Values: 0:RawSensor, 1:KalmanFilter
|
2017-02-27 18:50:04 -04:00
|
|
|
// @User: Advanced
|
|
|
|
AP_GROUPINFO("EST_TYPE", 5, AC_PrecLand, _estimator_type, 1),
|
|
|
|
|
2017-03-16 05:06:05 -03:00
|
|
|
// @Param: ACC_P_NSE
|
|
|
|
// @DisplayName: Kalman Filter Accelerometer Noise
|
|
|
|
// @Description: Kalman Filter Accelerometer Noise, higher values weight the input from the camera more, accels less
|
|
|
|
// @Range: 0.5 5
|
2020-09-13 19:38:28 -03:00
|
|
|
// @User: Advanced
|
2017-03-16 05:06:05 -03:00
|
|
|
AP_GROUPINFO("ACC_P_NSE", 6, AC_PrecLand, _accel_noise, 2.5f),
|
2016-12-19 19:20:18 -04:00
|
|
|
|
2017-03-17 19:37:42 -03:00
|
|
|
// @Param: CAM_POS_X
|
|
|
|
// @DisplayName: Camera X position offset
|
|
|
|
// @Description: X position of the camera in body frame. Positive X is forward of the origin.
|
|
|
|
// @Units: m
|
2020-01-30 00:30:57 -04:00
|
|
|
// @Range: -5 5
|
|
|
|
// @Increment: 0.01
|
2017-03-17 19:37:42 -03:00
|
|
|
// @User: Advanced
|
|
|
|
|
|
|
|
// @Param: CAM_POS_Y
|
|
|
|
// @DisplayName: Camera Y position offset
|
|
|
|
// @Description: Y position of the camera in body frame. Positive Y is to the right of the origin.
|
|
|
|
// @Units: m
|
2020-01-30 00:30:57 -04:00
|
|
|
// @Range: -5 5
|
|
|
|
// @Increment: 0.01
|
2017-03-17 19:37:42 -03:00
|
|
|
// @User: Advanced
|
|
|
|
|
|
|
|
// @Param: CAM_POS_Z
|
|
|
|
// @DisplayName: Camera Z position offset
|
|
|
|
// @Description: Z position of the camera in body frame. Positive Z is down from the origin.
|
|
|
|
// @Units: m
|
2020-01-30 00:30:57 -04:00
|
|
|
// @Range: -5 5
|
|
|
|
// @Increment: 0.01
|
2017-03-17 19:37:42 -03:00
|
|
|
// @User: Advanced
|
|
|
|
AP_GROUPINFO("CAM_POS", 7, AC_PrecLand, _cam_offset, 0.0f),
|
|
|
|
|
2017-04-11 21:19:21 -03:00
|
|
|
// @Param: BUS
|
|
|
|
// @DisplayName: Sensor Bus
|
|
|
|
// @Description: Precland sensor bus for I2C sensors.
|
|
|
|
// @Values: -1:DefaultBus,0:InternalI2C,1:ExternalI2C
|
|
|
|
// @User: Advanced
|
|
|
|
AP_GROUPINFO("BUS", 8, AC_PrecLand, _bus, -1),
|
2018-07-11 09:58:38 -03:00
|
|
|
|
2018-09-18 23:15:58 -03:00
|
|
|
// @Param: LAG
|
|
|
|
// @DisplayName: Precision Landing sensor lag
|
2019-02-04 14:10:57 -04:00
|
|
|
// @Description: Precision Landing sensor lag, to cope with variable landing_target latency
|
2018-09-19 00:34:47 -03:00
|
|
|
// @Range: 0.02 0.250
|
2018-07-11 09:58:38 -03:00
|
|
|
// @Increment: 1
|
2018-09-19 00:34:47 -03:00
|
|
|
// @Units: s
|
2018-09-18 23:15:58 -03:00
|
|
|
// @User: Advanced
|
|
|
|
// @RebootRequired: True
|
2019-04-04 01:57:42 -03:00
|
|
|
AP_GROUPINFO("LAG", 9, AC_PrecLand, _lag, 0.02f), // 20ms is the old default buffer size (8 frames @ 400hz/2.5ms)
|
2018-07-11 09:58:38 -03:00
|
|
|
|
2015-02-16 00:37:13 -04:00
|
|
|
AP_GROUPEND
|
|
|
|
};
|
|
|
|
|
|
|
|
// Default constructor.
|
|
|
|
// Note that the Vector/Matrix constructors already implicitly zero
|
|
|
|
// their values.
|
|
|
|
//
|
2018-07-15 21:29:20 -03:00
|
|
|
AC_PrecLand::AC_PrecLand()
|
2015-02-16 00:37:13 -04:00
|
|
|
{
|
|
|
|
// set parameters to defaults
|
|
|
|
AP_Param::setup_object_defaults(this, var_info);
|
|
|
|
}
|
|
|
|
|
2018-09-21 04:01:30 -03:00
|
|
|
// perform any required initialisation of landing controllers
|
|
|
|
// update_rate_hz should be the rate at which the update method will be called in hz
|
|
|
|
void AC_PrecLand::init(uint16_t update_rate_hz)
|
2015-02-16 00:37:13 -04:00
|
|
|
{
|
|
|
|
// exit immediately if init has already been run
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_backend != nullptr) {
|
2015-02-16 00:37:13 -04:00
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
|
|
|
// default health to false
|
2016-10-30 02:24:21 -03:00
|
|
|
_backend = nullptr;
|
2015-02-16 00:37:13 -04:00
|
|
|
_backend_state.healthy = false;
|
|
|
|
|
2018-09-21 04:01:30 -03:00
|
|
|
// create inertial history buffer
|
|
|
|
// constrain lag parameter to be within bounds
|
|
|
|
_lag = constrain_float(_lag, 0.02f, 0.25f);
|
|
|
|
|
|
|
|
// calculate inertial buffer size from lag and minimum of main loop rate and update_rate_hz argument
|
|
|
|
const uint16_t inertial_buffer_size = MAX((uint16_t)roundf(_lag * MIN(update_rate_hz, AP::scheduler().get_loop_rate_hz())), 1);
|
|
|
|
|
|
|
|
// instantiate ring buffer to hold inertial history, return on failure so no backends are created
|
|
|
|
_inertial_history = new ObjectArray<inertial_data_frame_s>(inertial_buffer_size);
|
|
|
|
if (_inertial_history == nullptr) {
|
2018-09-19 00:34:47 -03:00
|
|
|
return;
|
2018-07-11 09:58:38 -03:00
|
|
|
}
|
|
|
|
|
2015-02-16 00:37:13 -04:00
|
|
|
// instantiate backend based on type parameter
|
2021-04-14 00:16:18 -03:00
|
|
|
switch ((Type)(_type.get())) {
|
2015-02-16 00:37:13 -04:00
|
|
|
// no type defined
|
2021-04-14 00:16:18 -03:00
|
|
|
case Type::NONE:
|
2015-02-16 00:37:13 -04:00
|
|
|
default:
|
|
|
|
return;
|
|
|
|
// companion computer
|
2021-04-14 00:16:18 -03:00
|
|
|
case Type::COMPANION:
|
2015-02-16 00:37:13 -04:00
|
|
|
_backend = new AC_PrecLand_Companion(*this, _backend_state);
|
|
|
|
break;
|
|
|
|
// IR Lock
|
2021-04-14 00:16:18 -03:00
|
|
|
case Type::IRLOCK:
|
2015-02-16 00:37:13 -04:00
|
|
|
_backend = new AC_PrecLand_IRLock(*this, _backend_state);
|
|
|
|
break;
|
2016-11-10 07:41:17 -04:00
|
|
|
#if CONFIG_HAL_BOARD == HAL_BOARD_SITL
|
2021-04-14 00:16:18 -03:00
|
|
|
case Type::SITL_GAZEBO:
|
2016-11-10 07:41:17 -04:00
|
|
|
_backend = new AC_PrecLand_SITL_Gazebo(*this, _backend_state);
|
|
|
|
break;
|
2021-04-14 00:16:18 -03:00
|
|
|
case Type::SITL:
|
2016-11-11 01:10:35 -04:00
|
|
|
_backend = new AC_PrecLand_SITL(*this, _backend_state);
|
|
|
|
break;
|
2015-09-01 21:10:04 -03:00
|
|
|
#endif
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// init backend
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_backend != nullptr) {
|
2015-02-16 00:37:13 -04:00
|
|
|
_backend->init();
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
|
|
|
// update - give chance to driver to get updates from sensor
|
2016-07-15 14:30:21 -03:00
|
|
|
void AC_PrecLand::update(float rangefinder_alt_cm, bool rangefinder_alt_valid)
|
2015-02-16 00:37:13 -04:00
|
|
|
{
|
2018-09-18 23:15:58 -03:00
|
|
|
// exit immediately if not enabled
|
|
|
|
if (_backend == nullptr || _inertial_history == nullptr) {
|
|
|
|
return;
|
|
|
|
}
|
2018-07-11 09:58:38 -03:00
|
|
|
|
2017-03-16 05:01:16 -03:00
|
|
|
// append current velocity and attitude correction into history buffer
|
2017-02-27 18:50:04 -04:00
|
|
|
struct inertial_data_frame_s inertial_data_newest;
|
2021-07-21 05:10:27 -03:00
|
|
|
const auto &_ahrs = AP::ahrs();
|
2017-02-27 18:50:04 -04:00
|
|
|
_ahrs.getCorrectedDeltaVelocityNED(inertial_data_newest.correctedVehicleDeltaVelocityNED, inertial_data_newest.dt);
|
|
|
|
inertial_data_newest.Tbn = _ahrs.get_rotation_body_to_ned();
|
2018-04-10 12:20:26 -03:00
|
|
|
Vector3f curr_vel;
|
|
|
|
nav_filter_status status;
|
|
|
|
if (!_ahrs.get_velocity_NED(curr_vel) || !_ahrs.get_filter_status(status)) {
|
|
|
|
inertial_data_newest.inertialNavVelocityValid = false;
|
|
|
|
} else {
|
|
|
|
inertial_data_newest.inertialNavVelocityValid = status.flags.horiz_vel;
|
|
|
|
}
|
|
|
|
curr_vel.z = -curr_vel.z; // NED to NEU
|
|
|
|
inertial_data_newest.inertialNavVelocity = curr_vel;
|
|
|
|
|
2018-07-11 09:58:38 -03:00
|
|
|
inertial_data_newest.time_usec = AP_HAL::micros64();
|
|
|
|
_inertial_history->push_force(inertial_data_newest);
|
2017-03-16 05:01:16 -03:00
|
|
|
|
|
|
|
// update estimator of target position
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_backend != nullptr && _enabled) {
|
2015-02-16 00:37:13 -04:00
|
|
|
_backend->update();
|
2017-02-27 18:50:04 -04:00
|
|
|
run_estimator(rangefinder_alt_cm*0.01f, rangefinder_alt_valid);
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
2021-04-12 07:40:26 -03:00
|
|
|
|
|
|
|
const uint32_t now = AP_HAL::millis();
|
|
|
|
if (now - last_log_ms > 40) { // 25Hz
|
|
|
|
last_log_ms = now;
|
|
|
|
Write_Precland();
|
|
|
|
}
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
bool AC_PrecLand::target_acquired()
|
2015-02-16 00:37:13 -04:00
|
|
|
{
|
2021-06-05 06:31:44 -03:00
|
|
|
if ((AP_HAL::millis()-_last_update_ms) > LANDING_TARGET_TIMEOUT_MS) {
|
|
|
|
// not had a sensor update since a long time
|
|
|
|
// probably lost the target
|
|
|
|
_estimator_initialized = false;
|
|
|
|
_target_acquired = false;
|
|
|
|
}
|
2017-02-27 18:50:04 -04:00
|
|
|
return _target_acquired;
|
2016-06-16 14:10:48 -03:00
|
|
|
}
|
2015-02-16 00:37:13 -04:00
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
bool AC_PrecLand::get_target_position_cm(Vector2f& ret)
|
2016-06-16 14:10:48 -03:00
|
|
|
{
|
|
|
|
if (!target_acquired()) {
|
|
|
|
return false;
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
2018-04-10 12:20:26 -03:00
|
|
|
Vector2f curr_pos;
|
2018-07-15 21:29:20 -03:00
|
|
|
if (!AP::ahrs().get_relative_position_NE_origin(curr_pos)) {
|
2018-04-10 12:20:26 -03:00
|
|
|
return false;
|
|
|
|
}
|
|
|
|
ret.x = (_target_pos_rel_out_NE.x + curr_pos.x) * 100.0f; // m to cm
|
|
|
|
ret.y = (_target_pos_rel_out_NE.y + curr_pos.y) * 100.0f; // m to cm
|
2016-06-16 14:10:48 -03:00
|
|
|
return true;
|
|
|
|
}
|
|
|
|
|
2018-08-07 22:23:08 -03:00
|
|
|
void AC_PrecLand::get_target_position_measurement_cm(Vector3f& ret)
|
|
|
|
{
|
|
|
|
ret = _target_pos_rel_meas_NED*100.0f;
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
bool AC_PrecLand::get_target_position_relative_cm(Vector2f& ret)
|
2016-06-16 14:10:48 -03:00
|
|
|
{
|
|
|
|
if (!target_acquired()) {
|
|
|
|
return false;
|
|
|
|
}
|
2017-02-27 18:50:04 -04:00
|
|
|
ret = _target_pos_rel_out_NE*100.0f;
|
2016-07-15 14:30:21 -03:00
|
|
|
return true;
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
bool AC_PrecLand::get_target_velocity_relative_cms(Vector2f& ret)
|
2015-02-16 00:37:13 -04:00
|
|
|
{
|
2016-07-15 14:30:21 -03:00
|
|
|
if (!target_acquired()) {
|
|
|
|
return false;
|
2016-06-16 14:10:48 -03:00
|
|
|
}
|
2017-02-27 18:50:04 -04:00
|
|
|
ret = _target_vel_rel_out_NE*100.0f;
|
2016-07-15 14:30:21 -03:00
|
|
|
return true;
|
2015-02-16 00:37:13 -04:00
|
|
|
}
|
2015-09-11 08:00:18 -03:00
|
|
|
|
|
|
|
// handle_msg - Process a LANDING_TARGET mavlink message
|
2021-04-12 23:49:59 -03:00
|
|
|
void AC_PrecLand::handle_msg(const mavlink_landing_target_t &packet, uint32_t timestamp_ms)
|
2015-09-11 08:00:18 -03:00
|
|
|
{
|
|
|
|
// run backend update
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_backend != nullptr) {
|
2021-04-12 23:49:59 -03:00
|
|
|
_backend->handle_msg(packet, timestamp_ms);
|
2015-09-11 08:00:18 -03:00
|
|
|
}
|
|
|
|
}
|
2017-02-27 18:50:04 -04:00
|
|
|
|
|
|
|
//
|
|
|
|
// Private methods
|
|
|
|
//
|
|
|
|
|
|
|
|
void AC_PrecLand::run_estimator(float rangefinder_alt_m, bool rangefinder_alt_valid)
|
|
|
|
{
|
2018-07-11 09:58:38 -03:00
|
|
|
const struct inertial_data_frame_s *inertial_data_delayed = (*_inertial_history)[0];
|
2017-02-27 18:50:04 -04:00
|
|
|
|
2021-04-14 00:02:22 -03:00
|
|
|
switch ((EstimatorType)_estimator_type.get()) {
|
|
|
|
case EstimatorType::RAW_SENSOR: {
|
2017-02-27 18:50:04 -04:00
|
|
|
// Return if there's any invalid velocity data
|
2018-07-11 09:58:38 -03:00
|
|
|
for (uint8_t i=0; i<_inertial_history->available(); i++) {
|
|
|
|
const struct inertial_data_frame_s *inertial_data = (*_inertial_history)[i];
|
|
|
|
if (!inertial_data->inertialNavVelocityValid) {
|
2017-02-27 18:50:04 -04:00
|
|
|
_target_acquired = false;
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
|
|
|
// Predict
|
|
|
|
if (target_acquired()) {
|
2018-07-11 09:58:38 -03:00
|
|
|
_target_pos_rel_est_NE.x -= inertial_data_delayed->inertialNavVelocity.x * inertial_data_delayed->dt;
|
|
|
|
_target_pos_rel_est_NE.y -= inertial_data_delayed->inertialNavVelocity.y * inertial_data_delayed->dt;
|
|
|
|
_target_vel_rel_est_NE.x = -inertial_data_delayed->inertialNavVelocity.x;
|
|
|
|
_target_vel_rel_est_NE.y = -inertial_data_delayed->inertialNavVelocity.y;
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
|
|
|
|
2019-02-04 14:10:57 -04:00
|
|
|
// Update if a new Line-Of-Sight measurement is available
|
2017-03-17 19:37:42 -03:00
|
|
|
if (construct_pos_meas_using_rangefinder(rangefinder_alt_m, rangefinder_alt_valid)) {
|
|
|
|
_target_pos_rel_est_NE.x = _target_pos_rel_meas_NED.x;
|
|
|
|
_target_pos_rel_est_NE.y = _target_pos_rel_meas_NED.y;
|
2018-07-11 09:58:38 -03:00
|
|
|
_target_vel_rel_est_NE.x = -inertial_data_delayed->inertialNavVelocity.x;
|
|
|
|
_target_vel_rel_est_NE.y = -inertial_data_delayed->inertialNavVelocity.y;
|
2017-02-27 18:50:04 -04:00
|
|
|
|
2017-03-17 19:37:42 -03:00
|
|
|
_last_update_ms = AP_HAL::millis();
|
|
|
|
_target_acquired = true;
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// Output prediction
|
|
|
|
if (target_acquired()) {
|
|
|
|
run_output_prediction();
|
|
|
|
}
|
|
|
|
break;
|
|
|
|
}
|
2021-04-14 00:02:22 -03:00
|
|
|
case EstimatorType::KALMAN_FILTER: {
|
2017-02-27 18:50:04 -04:00
|
|
|
// Predict
|
|
|
|
if (target_acquired()) {
|
2018-07-11 09:58:38 -03:00
|
|
|
const float& dt = inertial_data_delayed->dt;
|
|
|
|
const Vector3f& vehicleDelVel = inertial_data_delayed->correctedVehicleDeltaVelocityNED;
|
2017-02-27 18:50:04 -04:00
|
|
|
|
2017-03-16 05:06:05 -03:00
|
|
|
_ekf_x.predict(dt, -vehicleDelVel.x, _accel_noise*dt);
|
|
|
|
_ekf_y.predict(dt, -vehicleDelVel.y, _accel_noise*dt);
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
|
|
|
|
2019-02-04 14:10:57 -04:00
|
|
|
// Update if a new Line-Of-Sight measurement is available
|
2017-03-17 19:37:42 -03:00
|
|
|
if (construct_pos_meas_using_rangefinder(rangefinder_alt_m, rangefinder_alt_valid)) {
|
2018-07-15 21:29:20 -03:00
|
|
|
float xy_pos_var = sq(_target_pos_rel_meas_NED.z*(0.01f + 0.01f*AP::ahrs().get_gyro().length()) + 0.02f);
|
2021-06-05 06:31:44 -03:00
|
|
|
if (!_estimator_initialized) {
|
|
|
|
// start init of EKF. We will let the filter consume the data for a while before it available for consumption
|
2017-03-17 19:37:42 -03:00
|
|
|
// reset filter state
|
2018-07-11 09:58:38 -03:00
|
|
|
if (inertial_data_delayed->inertialNavVelocityValid) {
|
|
|
|
_ekf_x.init(_target_pos_rel_meas_NED.x, xy_pos_var, -inertial_data_delayed->inertialNavVelocity.x, sq(2.0f));
|
|
|
|
_ekf_y.init(_target_pos_rel_meas_NED.y, xy_pos_var, -inertial_data_delayed->inertialNavVelocity.y, sq(2.0f));
|
2017-02-27 18:50:04 -04:00
|
|
|
} else {
|
2017-03-17 19:37:42 -03:00
|
|
|
_ekf_x.init(_target_pos_rel_meas_NED.x, xy_pos_var, 0.0f, sq(10.0f));
|
|
|
|
_ekf_y.init(_target_pos_rel_meas_NED.y, xy_pos_var, 0.0f, sq(10.0f));
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
2017-03-17 19:37:42 -03:00
|
|
|
_last_update_ms = AP_HAL::millis();
|
2021-06-05 06:31:44 -03:00
|
|
|
_estimator_init_ms = AP_HAL::millis();
|
|
|
|
// we have initialized the estimator but will not use the values for sometime so that EKF settles down
|
|
|
|
_estimator_initialized = true;
|
2017-03-17 19:37:42 -03:00
|
|
|
} else {
|
|
|
|
float NIS_x = _ekf_x.getPosNIS(_target_pos_rel_meas_NED.x, xy_pos_var);
|
|
|
|
float NIS_y = _ekf_y.getPosNIS(_target_pos_rel_meas_NED.y, xy_pos_var);
|
|
|
|
if (MAX(NIS_x, NIS_y) < 3.0f || _outlier_reject_count >= 3) {
|
|
|
|
_outlier_reject_count = 0;
|
|
|
|
_ekf_x.fusePos(_target_pos_rel_meas_NED.x, xy_pos_var);
|
|
|
|
_ekf_y.fusePos(_target_pos_rel_meas_NED.y, xy_pos_var);
|
2017-02-27 18:50:04 -04:00
|
|
|
_last_update_ms = AP_HAL::millis();
|
|
|
|
} else {
|
2017-03-17 19:37:42 -03:00
|
|
|
_outlier_reject_count++;
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2021-06-05 06:31:44 -03:00
|
|
|
// check EKF was properly initialized when the sensor detected a landing target
|
|
|
|
check_ekf_init_timeout();
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
// Output prediction
|
|
|
|
if (target_acquired()) {
|
|
|
|
_target_pos_rel_est_NE.x = _ekf_x.getPos();
|
|
|
|
_target_pos_rel_est_NE.y = _ekf_y.getPos();
|
|
|
|
_target_vel_rel_est_NE.x = _ekf_x.getVel();
|
|
|
|
_target_vel_rel_est_NE.y = _ekf_y.getVel();
|
|
|
|
|
|
|
|
run_output_prediction();
|
|
|
|
}
|
|
|
|
break;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2021-06-05 06:31:44 -03:00
|
|
|
|
|
|
|
// check if EKF got the time to initialize when the landing target was first detected
|
|
|
|
// Expects sensor to update within EKF_INIT_SENSOR_MIN_UPDATE_MS milliseconds till EKF_INIT_TIME_MS milliseconds have passed
|
|
|
|
// after this period landing target estimates can be used by vehicle
|
|
|
|
void AC_PrecLand::check_ekf_init_timeout()
|
|
|
|
{
|
|
|
|
if (!target_acquired() && _estimator_initialized) {
|
|
|
|
// we have just got the target in sight
|
|
|
|
if (AP_HAL::millis()-_last_update_ms > EKF_INIT_SENSOR_MIN_UPDATE_MS) {
|
|
|
|
// we have lost the target, not enough readings to initialize the EKF
|
|
|
|
_estimator_initialized = false;
|
|
|
|
} else if (AP_HAL::millis()-_estimator_init_ms > EKF_INIT_TIME_MS) {
|
|
|
|
// the target has been visible for a while, EKF should now have initialized to a good value
|
|
|
|
_target_acquired = true;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
bool AC_PrecLand::retrieve_los_meas(Vector3f& target_vec_unit_body)
|
|
|
|
{
|
|
|
|
if (_backend->have_los_meas() && _backend->los_meas_time_ms() != _last_backend_los_meas_ms) {
|
|
|
|
_last_backend_los_meas_ms = _backend->los_meas_time_ms();
|
|
|
|
_backend->get_los_body(target_vec_unit_body);
|
2021-06-05 15:43:27 -03:00
|
|
|
if (!is_zero(_yaw_align)) {
|
|
|
|
// Apply sensor yaw alignment rotation
|
|
|
|
target_vec_unit_body.rotate_xy(radians(_yaw_align*0.01f));
|
|
|
|
}
|
2017-02-27 18:50:04 -04:00
|
|
|
return true;
|
|
|
|
} else {
|
|
|
|
return false;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2017-03-17 19:37:42 -03:00
|
|
|
bool AC_PrecLand::construct_pos_meas_using_rangefinder(float rangefinder_alt_m, bool rangefinder_alt_valid)
|
|
|
|
{
|
|
|
|
Vector3f target_vec_unit_body;
|
|
|
|
if (retrieve_los_meas(target_vec_unit_body)) {
|
2018-07-11 09:58:38 -03:00
|
|
|
const struct inertial_data_frame_s *inertial_data_delayed = (*_inertial_history)[0];
|
2017-03-17 19:37:42 -03:00
|
|
|
|
2021-06-05 07:45:13 -03:00
|
|
|
const Vector3f target_vec_unit_ned = inertial_data_delayed->Tbn * target_vec_unit_body;
|
|
|
|
const bool target_vec_valid = target_vec_unit_ned.z > 0.0f;
|
|
|
|
const bool alt_valid = (rangefinder_alt_valid && rangefinder_alt_m > 0.0f) || (_backend->distance_to_target() > 0.0f);
|
2017-03-17 19:37:42 -03:00
|
|
|
if (target_vec_valid && alt_valid) {
|
2017-03-17 22:08:34 -03:00
|
|
|
float dist, alt;
|
2021-06-05 07:45:13 -03:00
|
|
|
// figure out ned camera orientation w.r.t its offset
|
|
|
|
Vector3f cam_pos_ned;
|
|
|
|
if (!_cam_offset.get().is_zero()) {
|
|
|
|
// user has specifed offset for camera
|
|
|
|
// take its height into account while calculating distance
|
|
|
|
cam_pos_ned = inertial_data_delayed->Tbn * _cam_offset;
|
|
|
|
}
|
2017-03-17 19:37:42 -03:00
|
|
|
if (_backend->distance_to_target() > 0.0f) {
|
2021-06-05 07:45:13 -03:00
|
|
|
// sensor has provided distance to landing target
|
2017-03-17 22:08:34 -03:00
|
|
|
dist = _backend->distance_to_target();
|
|
|
|
alt = dist * target_vec_unit_ned.z;
|
2017-03-17 19:37:42 -03:00
|
|
|
} else {
|
2021-06-05 07:45:13 -03:00
|
|
|
// sensor only knows the horizontal location of the landing target
|
|
|
|
// rely on rangefinder for the vertical target
|
|
|
|
alt = MAX(rangefinder_alt_m - cam_pos_ned.z, 0.0f);
|
2017-03-17 22:08:34 -03:00
|
|
|
dist = alt / target_vec_unit_ned.z;
|
2017-03-17 19:37:42 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
// Compute camera position relative to IMU
|
2021-06-05 07:45:13 -03:00
|
|
|
const Vector3f accel_pos_ned = inertial_data_delayed->Tbn * AP::ins().get_imu_pos_offset(AP::ahrs().get_primary_accel_index());
|
|
|
|
const Vector3f cam_pos_ned_rel_imu = cam_pos_ned - accel_pos_ned;
|
2017-03-17 19:37:42 -03:00
|
|
|
|
|
|
|
// Compute target position relative to IMU
|
2021-06-05 07:45:13 -03:00
|
|
|
_target_pos_rel_meas_NED = Vector3f{target_vec_unit_ned.x*dist, target_vec_unit_ned.y*dist, alt} + cam_pos_ned_rel_imu;
|
2017-03-17 19:37:42 -03:00
|
|
|
return true;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
return false;
|
|
|
|
}
|
|
|
|
|
2017-02-27 18:50:04 -04:00
|
|
|
void AC_PrecLand::run_output_prediction()
|
|
|
|
{
|
|
|
|
_target_pos_rel_out_NE = _target_pos_rel_est_NE;
|
|
|
|
_target_vel_rel_out_NE = _target_vel_rel_est_NE;
|
|
|
|
|
|
|
|
// Predict forward from delayed time horizon
|
2018-07-11 09:58:38 -03:00
|
|
|
for (uint8_t i=1; i<_inertial_history->available(); i++) {
|
|
|
|
const struct inertial_data_frame_s *inertial_data = (*_inertial_history)[i];
|
|
|
|
_target_vel_rel_out_NE.x -= inertial_data->correctedVehicleDeltaVelocityNED.x;
|
|
|
|
_target_vel_rel_out_NE.y -= inertial_data->correctedVehicleDeltaVelocityNED.y;
|
|
|
|
_target_pos_rel_out_NE.x += _target_vel_rel_out_NE.x * inertial_data->dt;
|
|
|
|
_target_pos_rel_out_NE.y += _target_vel_rel_out_NE.y * inertial_data->dt;
|
2017-02-27 18:50:04 -04:00
|
|
|
}
|
|
|
|
|
2018-07-15 21:29:20 -03:00
|
|
|
const AP_AHRS &_ahrs = AP::ahrs();
|
|
|
|
|
2018-07-11 09:58:38 -03:00
|
|
|
const Matrix3f& Tbn = (*_inertial_history)[_inertial_history->available()-1]->Tbn;
|
2018-03-10 05:34:16 -04:00
|
|
|
Vector3f accel_body_offset = AP::ins().get_imu_pos_offset(_ahrs.get_primary_accel_index());
|
2017-03-17 19:37:42 -03:00
|
|
|
|
|
|
|
// Apply position correction for CG offset from IMU
|
|
|
|
Vector3f imu_pos_ned = Tbn * accel_body_offset;
|
|
|
|
_target_pos_rel_out_NE.x += imu_pos_ned.x;
|
|
|
|
_target_pos_rel_out_NE.y += imu_pos_ned.y;
|
|
|
|
|
|
|
|
// Apply position correction for body-frame horizontal camera offset from CG, so that vehicle lands lens-to-target
|
|
|
|
Vector3f cam_pos_horizontal_ned = Tbn * Vector3f(_cam_offset.get().x, _cam_offset.get().y, 0);
|
|
|
|
_target_pos_rel_out_NE.x -= cam_pos_horizontal_ned.x;
|
|
|
|
_target_pos_rel_out_NE.y -= cam_pos_horizontal_ned.y;
|
|
|
|
|
|
|
|
// Apply velocity correction for IMU offset from CG
|
|
|
|
Vector3f vel_ned_rel_imu = Tbn * (_ahrs.get_gyro() % (-accel_body_offset));
|
|
|
|
_target_vel_rel_out_NE.x -= vel_ned_rel_imu.x;
|
|
|
|
_target_vel_rel_out_NE.y -= vel_ned_rel_imu.y;
|
|
|
|
|
|
|
|
// Apply land offset
|
2017-02-27 18:50:04 -04:00
|
|
|
Vector3f land_ofs_ned_m = _ahrs.get_rotation_body_to_ned() * Vector3f(_land_ofs_cm_x,_land_ofs_cm_y,0) * 0.01f;
|
|
|
|
_target_pos_rel_out_NE.x += land_ofs_ned_m.x;
|
|
|
|
_target_pos_rel_out_NE.y += land_ofs_ned_m.y;
|
|
|
|
}
|
2021-04-12 07:40:26 -03:00
|
|
|
|
|
|
|
// Write a precision landing entry
|
|
|
|
void AC_PrecLand::Write_Precland()
|
|
|
|
{
|
|
|
|
// exit immediately if not enabled
|
|
|
|
if (!enabled()) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
|
|
|
Vector3f target_pos_meas;
|
|
|
|
Vector2f target_pos_rel;
|
|
|
|
Vector2f target_vel_rel;
|
|
|
|
get_target_position_relative_cm(target_pos_rel);
|
|
|
|
get_target_velocity_relative_cms(target_vel_rel);
|
|
|
|
get_target_position_measurement_cm(target_pos_meas);
|
|
|
|
|
|
|
|
const struct log_Precland pkt {
|
|
|
|
LOG_PACKET_HEADER_INIT(LOG_PRECLAND_MSG),
|
|
|
|
time_us : AP_HAL::micros64(),
|
|
|
|
healthy : healthy(),
|
|
|
|
target_acquired : target_acquired(),
|
|
|
|
pos_x : target_pos_rel.x,
|
|
|
|
pos_y : target_pos_rel.y,
|
|
|
|
vel_x : target_vel_rel.x,
|
|
|
|
vel_y : target_vel_rel.y,
|
|
|
|
meas_x : target_pos_meas.x,
|
|
|
|
meas_y : target_pos_meas.y,
|
|
|
|
meas_z : target_pos_meas.z,
|
|
|
|
last_meas : last_backend_los_meas_ms(),
|
|
|
|
ekf_outcount : ekf_outlier_count(),
|
2021-04-14 00:02:22 -03:00
|
|
|
estimator : (uint8_t)_estimator_type
|
2021-04-12 07:40:26 -03:00
|
|
|
};
|
|
|
|
AP::logger().WriteBlock(&pkt, sizeof(pkt));
|
|
|
|
}
|
|
|
|
|