ardupilot/libraries/AP_InertialNav/AP_InertialNav_NavEKF.cpp

167 lines
4.0 KiB
C++
Raw Normal View History

/// -*- tab-width: 4; Mode: C++; c-basic-offset: 4; indent-tabs-mode: nil -*-
#include <AP_HAL.h>
#include "AP_InertialNav.h"
#if AP_AHRS_NAVEKF_AVAILABLE
/*
A wrapper around the AP_InertialNav class which uses the NavEKF
filter if available, and falls back to the AP_InertialNav filter
when EKF is not available
*/
/**
update internal state
*/
void AP_InertialNav_NavEKF::update(float dt)
{
_ahrs_ekf.get_NavEKF().getPosNED(_relpos_cm);
_relpos_cm *= 100; // convert to cm
_haveabspos = _ahrs_ekf.get_position(_abspos);
_ahrs_ekf.get_NavEKF().getVelNED(_velocity_cm);
_velocity_cm *= 100; // convert to cm/s
// InertialNav is NEU
_relpos_cm.z = - _relpos_cm.z;
_velocity_cm.z = -_velocity_cm.z;
}
/**
* get_filter_status : returns filter status as a series of flags
*/
nav_filter_status AP_InertialNav_NavEKF::get_filter_status() const
{
nav_filter_status ret;
_ahrs_ekf.get_NavEKF().getFilterStatus(ret);
return ret;
}
/**
* get_origin - returns the inertial navigation origin in lat/lon/alt
*/
struct Location AP_InertialNav_NavEKF::get_origin() const
{
struct Location ret;
if (!_ahrs_ekf.get_NavEKF().getOriginLLH(ret)) {
// initialise location to all zeros if origin not yet set
memset(&ret, 0, sizeof(ret));
}
return ret;
}
/**
* get_position - returns the current position relative to the home location in cm.
*
* @return
*/
const Vector3f &AP_InertialNav_NavEKF::get_position(void) const
{
return _relpos_cm;
}
2015-02-25 10:13:17 -04:00
/**
* get_location - updates the provided location with the latest calculated locatoin
* returns true on success (i.e. the EKF knows it's latest position), false on failure
*/
bool AP_InertialNav_NavEKF::get_location(struct Location &loc) const
{
return _ahrs_ekf.get_NavEKF().getLLH(loc);
}
/**
* get_latitude - returns the latitude of the current position estimation in 100 nano degrees (i.e. degree value multiplied by 10,000,000)
*/
int32_t AP_InertialNav_NavEKF::get_latitude() const
{
return _abspos.lat;
}
/**
* get_longitude - returns the longitude of the current position estimation in 100 nano degrees (i.e. degree value multiplied by 10,000,000)
* @return
*/
int32_t AP_InertialNav_NavEKF::get_longitude() const
{
return _abspos.lng;
}
/**
* get_velocity - returns the current velocity in cm/s
*
* @return velocity vector:
* .x : latitude velocity in cm/s
* .y : longitude velocity in cm/s
* .z : vertical velocity in cm/s
*/
const Vector3f &AP_InertialNav_NavEKF::get_velocity() const
{
return _velocity_cm;
}
/**
* get_velocity_xy - returns the current horizontal velocity in cm/s
*
* @returns the current horizontal velocity in cm/s
*/
2014-04-21 09:58:42 -03:00
float AP_InertialNav_NavEKF::get_velocity_xy() const
{
return pythagorous2(_velocity_cm.x, _velocity_cm.y);
}
/**
* get_altitude - get latest altitude estimate in cm
* @return
*/
float AP_InertialNav_NavEKF::get_altitude() const
{
return _relpos_cm.z;
}
/**
* getHgtAboveGnd - get latest height above ground level estimate in cm and a validity flag
*
* @return
*/
bool AP_InertialNav_NavEKF::get_hagl(float height) const
{
// true when estimate is valid
bool valid = _ahrs_ekf.get_NavEKF().getHAGL(height);
// convert height from m to cm
height *= 100.0f;
return valid;
}
/**
* get_hgt_ctrl_limit - get maximum height to be observed by the control loops in cm and a validity flag
* this is used to limit height during optical flow navigation
* it will return invalid when no limiting is required
* @return
*/
bool AP_InertialNav_NavEKF::get_hgt_ctrl_limit(float& limit) const
{
// true when estimate is valid
if (_ahrs_ekf.get_NavEKF().getHeightControlLimit(limit)) {
// convert height from m to cm
limit *= 100.0f;
return true;
}
return false;
}
/**
* get_velocity_z - returns the current climbrate.
*
* @see get_velocity().z
*
* @return climbrate in cm/s
*/
float AP_InertialNav_NavEKF::get_velocity_z() const
{
return _velocity_cm.z;
}
#endif // AP_AHRS_NAVEKF_AVAILABLE