FlightTaskManualAltitude: respect maximum altitude if there is a valid distance sensor

This commit is contained in:
Dennis Mannhart 2018-06-25 10:00:08 +02:00 committed by Lorenz Meier
parent c907e7a9dc
commit eb7139bc56
4 changed files with 61 additions and 5 deletions

View File

@ -7,6 +7,7 @@ float32 speed_up # in meters/sec
float32 speed_down # in meters/sec
float32 tilt # in radians [0, PI]
float32 min_distance_to_ground # in meters
float32 max_distance_to_ground # in meters
int8 GEAR_DOWN = -1
int8 GEAR_UP = 1

View File

@ -122,4 +122,5 @@ void FlightTask::_setDefaultConstraints()
_constraints.tilt = math::radians(MPC_TILTMAX_AIR.get());
_constraints.landing_gear = vehicle_constraints_s::GEAR_KEEP;
_constraints.min_distance_to_ground = NAN;
_constraints.max_distance_to_ground = NAN;
}

View File

@ -37,6 +37,7 @@
#include "FlightTaskManualAltitude.hpp"
#include <float.h>
#include <mathlib/mathlib.h>
using namespace matrix;
@ -62,6 +63,16 @@ bool FlightTaskManualAltitude::activate()
_constraints.min_distance_to_ground = -INFINITY;
}
if (PX4_ISFINITE(_sub_vehicle_local_position->get().hagl_max)) {
_constraints.max_distance_to_ground = _sub_vehicle_local_position->get().hagl_max;
} else {
_constraints.max_distance_to_ground = INFINITY;
}
_max_speed_up = _constraints.speed_up;
_min_speed_down = _constraints.speed_down;
return ret;
}
@ -88,7 +99,9 @@ void FlightTaskManualAltitude::_updateAltitudeLock()
if (MPC_ALT_MODE.get() && PX4_ISFINITE(_dist_to_bottom)) {
// terrain following
_terrain_following(apply_brake, stopped);
_terrainFollowing(apply_brake, stopped);
// respect maximum altitude
_respectMaxAltitude();
} else {
// normal mode where height is dependent on local frame
@ -98,9 +111,9 @@ void FlightTaskManualAltitude::_updateAltitudeLock()
_position_setpoint(2) = _position(2);
// Ensure that minimum altitude is respected if
// there is a distance sensor and distance to bottome is below minimum.
// there is a distance sensor and distance to bottom is below minimum.
if (PX4_ISFINITE(_dist_to_bottom) && _dist_to_bottom < _constraints.min_distance_to_ground) {
_terrain_following(apply_brake, stopped);
_terrainFollowing(apply_brake, stopped);
} else {
_dist_to_ground_lock = NAN;
@ -117,6 +130,8 @@ void FlightTaskManualAltitude::_updateAltitudeLock()
} else {
// user demands velocity change
_position_setpoint(2) = NAN;
// ensure that maximum altitude is respected
_respectMaxAltitude();
}
}
}
@ -134,7 +149,7 @@ void FlightTaskManualAltitude::_respectMinAltitude()
}
}
void FlightTaskManualAltitude::_terrain_following(bool apply_brake, bool stopped)
void FlightTaskManualAltitude::_terrainFollowing(bool apply_brake, bool stopped)
{
if (apply_brake && stopped && !PX4_ISFINITE(_dist_to_ground_lock)) {
// User wants to break and vehicle reached zero velocity. Lock height to ground.
@ -159,6 +174,41 @@ void FlightTaskManualAltitude::_terrain_following(bool apply_brake, bool stopped
_dist_to_ground_lock = _position_setpoint(2) = NAN;
}
}
void FlightTaskManualAltitude::_respectMaxAltitude()
{
if (PX4_ISFINITE(_dist_to_bottom)) {
// check if there is a valid minimum distance to ground
const float min_distance_to_ground = (PX4_ISFINITE(_constraints.min_distance_to_ground)) ?
_constraints.min_distance_to_ground : 0.0f;
// if there is a valid maximum distance to ground, gradually decrease speed limit upwards from
// minimum distance to maximum distance
if (PX4_ISFINITE(_constraints.max_distance_to_ground)) {
_constraints.speed_up = math::gradual(_dist_to_bottom, min_distance_to_ground, _constraints.max_distance_to_ground,
_max_speed_up, 0.0f);
} else {
_constraints.speed_up = _max_speed_up;
}
// if distance to bottom exceeded maximum distance, slowly approach maximum distance
if (_dist_to_bottom > _constraints.max_distance_to_ground) {
// difference between current distance to ground and maximum distance to ground
const float delta_distance_to_max = _dist_to_bottom - _constraints.max_distance_to_ground;
// set position setpoint to maximum distance to ground
_position_setpoint(2) = _position(2) + delta_distance_to_max;
// limit speed downwards to 0.7m/s
_constraints.speed_down = math::min(_min_speed_down, 0.7f);
} else {
_constraints.speed_down = _min_speed_down;
}
}
}
void FlightTaskManualAltitude::_updateSetpoints()
{
FlightTaskManualStabilized::_updateSetpoints(); // get yaw and thrust setpoints

View File

@ -66,6 +66,8 @@ protected:
)
private:
uint8_t _reset_counter = 0; /**< counter for estimator resets in z-direction */
float _max_speed_up = 10.0f;
float _min_speed_down = 1.0f;
/**
* Distance to ground during terrain following.
@ -82,7 +84,7 @@ private:
* @param apply_brake is true if user wants to break
* @param stopped is true if vehicle has stopped moving in D-direction
*/
void _terrain_following(bool apply_brake, bool stopped);
void _terrainFollowing(bool apply_brake, bool stopped);
/**
* Minimum Altitude during range sensor operation.
@ -91,4 +93,6 @@ private:
* altitude is only enforced during altitude lock.
*/
void _respectMinAltitude();
void _respectMaxAltitude();
};