2013-12-28 07:15:29 -04:00
/// -*- tab-width: 4; Mode: C++; c-basic-offset: 4; indent-tabs-mode: nil -*-
# include <AP_HAL.h>
# include <AC_PosControl.h>
extern const AP_HAL : : HAL & hal ;
const AP_Param : : GroupInfo AC_PosControl : : var_info [ ] PROGMEM = {
2013-12-28 10:04:45 -04:00
// @Param: THR_HOVER
// @DisplayName: Throttle Hover
// @Description: The autopilot's estimate of the throttle required to maintain a level hover. Calculated automatically from the pilot's throttle input while in stabilize mode
2013-12-28 07:15:29 -04:00
// @Range: 0 1000
2013-12-28 10:04:45 -04:00
// @Units: Percent*10
// @User: Advanced
AP_GROUPINFO ( " THR_HOVER " , 0 , AC_PosControl , _throttle_hover , POSCONTROL_THROTTLE_HOVER ) ,
2013-12-28 07:15:29 -04:00
AP_GROUPEND
} ;
// Default constructor.
// Note that the Vector/Matrix constructors already implicitly zero
// their values.
//
2013-12-28 10:04:45 -04:00
AC_PosControl : : AC_PosControl ( const AP_AHRS & ahrs , const AP_InertialNav & inav ,
const AP_Motors & motors , AC_AttitudeControl & attitude_control ,
2014-02-15 11:00:41 -04:00
AC_P & p_alt_pos , AC_P & p_alt_rate , AC_PID & pid_alt_accel ,
2014-02-14 03:05:29 -04:00
AC_P & p_pos_xy , AC_PID & pid_rate_lat , AC_PID & pid_rate_lon ) :
2013-12-28 07:15:29 -04:00
_ahrs ( ahrs ) ,
2013-12-28 10:04:45 -04:00
_inav ( inav ) ,
_motors ( motors ) ,
2013-12-28 07:15:29 -04:00
_attitude_control ( attitude_control ) ,
2014-02-14 03:05:29 -04:00
_p_alt_pos ( p_alt_pos ) ,
2014-02-15 11:00:41 -04:00
_p_alt_rate ( p_alt_rate ) ,
2013-12-28 07:15:29 -04:00
_pid_alt_accel ( pid_alt_accel ) ,
2014-02-14 03:05:29 -04:00
_p_pos_xy ( p_pos_xy ) ,
2013-12-28 07:15:29 -04:00
_pid_rate_lat ( pid_rate_lat ) ,
_pid_rate_lon ( pid_rate_lon ) ,
2013-12-28 10:04:45 -04:00
_dt ( POSCONTROL_DT_10HZ ) ,
2014-05-02 00:08:18 -03:00
_last_update_xy_ms ( 0 ) ,
_last_update_z_ms ( 0 ) ,
2014-01-17 22:53:46 -04:00
_speed_down_cms ( POSCONTROL_SPEED_DOWN ) ,
_speed_up_cms ( POSCONTROL_SPEED_UP ) ,
2013-12-28 10:04:45 -04:00
_speed_cms ( POSCONTROL_SPEED ) ,
2014-04-21 09:34:33 -03:00
_accel_z_cms ( POSCONTROL_ACCEL_Z ) ,
_accel_cms ( POSCONTROL_ACCEL_XY ) ,
2014-01-17 22:53:46 -04:00
_leash ( POSCONTROL_LEASH_LENGTH_MIN ) ,
_roll_target ( 0.0 ) ,
_pitch_target ( 0.0 ) ,
_alt_max ( 0 ) ,
_distance_to_target ( 0 ) ,
_xy_step ( 0 ) ,
_dt_xy ( 0 )
2013-12-28 07:15:29 -04:00
{
AP_Param : : setup_object_defaults ( this , var_info ) ;
2014-01-17 22:53:46 -04:00
// initialise flags
_flags . force_recalc_xy = false ;
# if HAL_CPU_CLASS >= HAL_CPU_CLASS_150
_flags . slow_cpu = false ;
# else
_flags . slow_cpu = true ;
# endif
2014-01-23 23:27:06 -04:00
_flags . recalc_leash_xy = true ;
_flags . recalc_leash_z = true ;
2014-04-23 02:40:06 -03:00
_flags . keep_xy_I_terms = false ;
2014-05-06 05:32:30 -03:00
_flags . reset_desired_vel_to_pos = true ;
_flags . reset_rate_to_accel_xy = true ;
2014-05-02 00:08:18 -03:00
_flags . reset_rate_to_accel_z = true ;
_flags . reset_accel_to_throttle = true ;
2013-12-28 07:15:29 -04:00
}
2013-12-28 10:04:45 -04:00
///
/// z-axis position controller
///
2013-12-28 07:15:29 -04:00
2014-05-27 10:44:57 -03:00
/// set_dt - sets time delta in seconds for all controllers (i.e. 100hz = 0.01, 400hz = 0.0025)
void AC_PosControl : : set_dt ( float delta_sec )
{
_dt = delta_sec ;
// update rate controller's d filter
2014-05-29 05:50:13 -03:00
_pid_alt_accel . set_d_lpf_alpha ( POSCONTROL_ACCEL_Z_DTERM_FILTER , _dt ) ;
2014-05-27 10:44:57 -03:00
}
2014-01-23 23:27:06 -04:00
/// set_speed_z - sets maximum climb and descent rates
2014-01-25 04:23:55 -04:00
/// To-Do: call this in the main code as part of flight mode initialisation
/// calc_leash_length_z should be called afterwards
/// speed_down should be a negative number
2014-01-23 23:27:06 -04:00
void AC_PosControl : : set_speed_z ( float speed_down , float speed_up )
{
2014-04-29 23:14:48 -03:00
// ensure speed_down is always negative
speed_down = - fabs ( speed_down ) ;
2014-01-23 23:27:06 -04:00
if ( ( fabs ( _speed_down_cms - speed_down ) > 1.0f ) | | ( fabs ( _speed_up_cms - speed_up ) > 1.0f ) ) {
_speed_down_cms = speed_down ;
_speed_up_cms = speed_up ;
_flags . recalc_leash_z = true ;
}
}
/// set_accel_z - set vertical acceleration in cm/s/s
void AC_PosControl : : set_accel_z ( float accel_cmss )
{
if ( fabs ( _accel_z_cms - accel_cmss ) > 1.0f ) {
_accel_z_cms = accel_cmss ;
_flags . recalc_leash_z = true ;
}
}
/// set_alt_target_with_slew - adjusts target towards a final altitude target
/// should be called continuously (with dt set to be the expected time between calls)
/// actual position target will be moved no faster than the speed_down and speed_up
/// target will also be stopped if the motors hit their limits or leash length is exceeded
void AC_PosControl : : set_alt_target_with_slew ( float alt_cm , float dt )
{
float alt_change = alt_cm - _pos_target . z ;
// adjust desired alt if motors have not hit their limits
if ( ( alt_change < 0 & & ! _motors . limit . throttle_lower ) | | ( alt_change > 0 & & ! _motors . limit . throttle_upper ) ) {
_pos_target . z + = constrain_float ( alt_change , _speed_down_cms * dt , _speed_up_cms * dt ) ;
}
// do not let target get too far from current altitude
float curr_alt = _inav . get_altitude ( ) ;
_pos_target . z = constrain_float ( _pos_target . z , curr_alt - _leash_down_z , curr_alt + _leash_up_z ) ;
}
/// set_alt_target_from_climb_rate - adjusts target up or down using a climb rate in cm/s
/// should be called continuously (with dt set to be the expected time between calls)
/// actual position target will be moved no faster than the speed_down and speed_up
/// target will also be stopped if the motors hit their limits or leash length is exceeded
void AC_PosControl : : set_alt_target_from_climb_rate ( float climb_rate_cms , float dt )
{
// adjust desired alt if motors have not hit their limits
// To-Do: add check of _limit.pos_up and _limit.pos_down?
if ( ( climb_rate_cms < 0 & & ! _motors . limit . throttle_lower ) | | ( climb_rate_cms > 0 & & ! _motors . limit . throttle_upper ) ) {
_pos_target . z + = climb_rate_cms * _dt ;
}
}
2014-01-05 23:30:51 -04:00
// get_alt_error - returns altitude error in cm
float AC_PosControl : : get_alt_error ( ) const
{
2014-01-23 23:27:06 -04:00
return ( _pos_target . z - _inav . get_altitude ( ) ) ;
2014-01-05 23:30:51 -04:00
}
2013-12-30 09:12:59 -04:00
/// set_target_to_stopping_point_z - returns reasonable stopping altitude in cm above home
void AC_PosControl : : set_target_to_stopping_point_z ( )
2013-12-28 10:04:45 -04:00
{
2014-04-30 09:22:47 -03:00
// check if z leash needs to be recalculated
calc_leash_length_z ( ) ;
2014-01-25 04:23:55 -04:00
get_stopping_point_z ( _pos_target ) ;
}
/// get_stopping_point_z - sets stopping_point.z to a reasonable stopping altitude in cm above home
2014-01-27 10:42:49 -04:00
void AC_PosControl : : get_stopping_point_z ( Vector3f & stopping_point ) const
2014-01-25 04:23:55 -04:00
{
const float curr_pos_z = _inav . get_altitude ( ) ;
2014-05-02 03:26:04 -03:00
float curr_vel_z = _inav . get_velocity_z ( ) ;
2014-01-25 04:23:55 -04:00
2014-03-16 21:40:11 -03:00
float linear_distance ; // half the distance we swap between linear and sqrt and the distance we offset sqrt
2013-12-28 10:04:45 -04:00
float linear_velocity ; // the velocity we swap between linear and sqrt
2014-05-02 03:26:04 -03:00
// if position controller is active add current velocity error to avoid sudden jump in acceleration
if ( is_active_z ( ) ) {
curr_vel_z + = _vel_error . z ;
}
2014-03-16 21:40:11 -03:00
// calculate the velocity at which we switch from calculating the stopping point using a linear function to a sqrt function
2014-04-21 09:34:33 -03:00
linear_velocity = _accel_z_cms / _p_alt_pos . kP ( ) ;
2013-12-28 10:04:45 -04:00
2014-01-25 04:23:55 -04:00
if ( fabs ( curr_vel_z ) < linear_velocity ) {
2013-12-28 10:04:45 -04:00
// if our current velocity is below the cross-over point we use a linear function
2014-02-14 03:05:29 -04:00
stopping_point . z = curr_pos_z + curr_vel_z / _p_alt_pos . kP ( ) ;
2013-12-28 07:15:29 -04:00
} else {
2014-04-21 09:34:33 -03:00
linear_distance = _accel_z_cms / ( 2.0f * _p_alt_pos . kP ( ) * _p_alt_pos . kP ( ) ) ;
2014-01-25 04:23:55 -04:00
if ( curr_vel_z > 0 ) {
2014-04-21 09:34:33 -03:00
stopping_point . z = curr_pos_z + ( linear_distance + curr_vel_z * curr_vel_z / ( 2.0f * _accel_z_cms ) ) ;
2013-12-28 07:15:29 -04:00
} else {
2014-04-21 09:34:33 -03:00
stopping_point . z = curr_pos_z - ( linear_distance + curr_vel_z * curr_vel_z / ( 2.0f * _accel_z_cms ) ) ;
2013-12-28 07:15:29 -04:00
}
}
2014-01-25 04:23:55 -04:00
stopping_point . z = constrain_float ( stopping_point . z , curr_pos_z - POSCONTROL_STOPPING_DIST_Z_MAX , curr_pos_z + POSCONTROL_STOPPING_DIST_Z_MAX ) ;
2013-12-28 07:15:29 -04:00
}
2013-12-30 09:12:59 -04:00
/// init_takeoff - initialises target altitude if we are taking off
void AC_PosControl : : init_takeoff ( )
{
const Vector3f & curr_pos = _inav . get_position ( ) ;
_pos_target . z = curr_pos . z + POSCONTROL_TAKEOFF_JUMP_CM ;
// clear i term from acceleration controller
if ( _pid_alt_accel . get_integrator ( ) < 0 ) {
_pid_alt_accel . reset_I ( ) ;
}
}
2014-05-02 00:08:18 -03:00
// is_active_z - returns true if the z-axis position controller has been run very recently
bool AC_PosControl : : is_active_z ( ) const
{
return ( ( hal . scheduler - > millis ( ) - _last_update_z_ms ) < = POSCONTROL_ACTIVE_TIMEOUT_MS ) ;
}
2014-01-17 22:53:46 -04:00
/// update_z_controller - fly to altitude in cm above home
void AC_PosControl : : update_z_controller ( )
2013-12-28 10:04:45 -04:00
{
2014-05-02 00:08:18 -03:00
// check time since last cast
uint32_t now = hal . scheduler - > millis ( ) ;
if ( now - _last_update_z_ms > POSCONTROL_ACTIVE_TIMEOUT_MS ) {
_flags . reset_rate_to_accel_z = true ;
_flags . reset_accel_to_throttle = true ;
}
_last_update_z_ms = now ;
2014-01-23 23:27:06 -04:00
// check if leash lengths need to be recalculated
calc_leash_length_z ( ) ;
2013-12-28 10:04:45 -04:00
// call position controller
2013-12-30 09:12:59 -04:00
pos_to_rate_z ( ) ;
2013-12-28 10:04:45 -04:00
}
2014-01-23 23:27:06 -04:00
/// calc_leash_length - calculates the vertical leash lengths from maximum speed, acceleration
/// called by pos_to_rate_z if z-axis speed or accelerations are changed
void AC_PosControl : : calc_leash_length_z ( )
2013-12-28 10:04:45 -04:00
{
2014-01-23 23:27:06 -04:00
if ( _flags . recalc_leash_z ) {
2014-02-14 03:05:29 -04:00
_leash_up_z = calc_leash_length ( _speed_up_cms , _accel_z_cms , _p_alt_pos . kP ( ) ) ;
2014-03-13 14:30:31 -03:00
_leash_down_z = calc_leash_length ( - _speed_down_cms , _accel_z_cms , _p_alt_pos . kP ( ) ) ;
2014-01-23 23:27:06 -04:00
_flags . recalc_leash_z = false ;
}
}
// pos_to_rate_z - position to rate controller for Z axis
// calculates desired rate in earth-frame z axis and passes to rate controller
// vel_up_max, vel_down_max should have already been set before calling this method
void AC_PosControl : : pos_to_rate_z ( )
{
float curr_alt = _inav . get_altitude ( ) ;
float linear_distance ; // half the distance we swap between linear and sqrt and the distance we offset sqrt.
2013-12-28 10:04:45 -04:00
// clear position limit flags
_limit . pos_up = false ;
_limit . pos_down = false ;
2014-01-23 23:27:06 -04:00
// calculate altitude error
_pos_error . z = _pos_target . z - curr_alt ;
2013-12-28 10:04:45 -04:00
// do not let target altitude get too far from current altitude
2014-01-23 23:27:06 -04:00
if ( _pos_error . z > _leash_up_z ) {
_pos_target . z = curr_alt + _leash_up_z ;
2014-02-17 06:46:05 -04:00
_pos_error . z = _leash_up_z ;
2013-12-28 10:04:45 -04:00
_limit . pos_up = true ;
}
2014-01-23 23:27:06 -04:00
if ( _pos_error . z < - _leash_down_z ) {
_pos_target . z = curr_alt - _leash_down_z ;
2014-02-17 06:46:05 -04:00
_pos_error . z = - _leash_down_z ;
2014-01-23 23:27:06 -04:00
_limit . pos_down = true ;
}
2013-12-28 10:04:45 -04:00
// do not let target alt get above limit
if ( _alt_max > 0 & & _pos_target . z > _alt_max ) {
_pos_target . z = _alt_max ;
_limit . pos_up = true ;
}
2013-12-28 07:15:29 -04:00
// check kP to avoid division by zero
2014-02-14 03:05:29 -04:00
if ( _p_alt_pos . kP ( ) ! = 0 ) {
2014-04-21 09:34:33 -03:00
linear_distance = _accel_z_cms / ( 2.0f * _p_alt_pos . kP ( ) * _p_alt_pos . kP ( ) ) ;
2013-12-28 10:04:45 -04:00
if ( _pos_error . z > 2 * linear_distance ) {
2014-04-21 09:34:33 -03:00
_vel_target . z = safe_sqrt ( 2.0f * _accel_z_cms * ( _pos_error . z - linear_distance ) ) ;
2013-12-28 10:04:45 -04:00
} else if ( _pos_error . z < - 2.0f * linear_distance ) {
2014-04-21 09:34:33 -03:00
_vel_target . z = - safe_sqrt ( 2.0f * _accel_z_cms * ( - _pos_error . z - linear_distance ) ) ;
2013-12-28 07:15:29 -04:00
} else {
2014-02-14 03:05:29 -04:00
_vel_target . z = _p_alt_pos . get_p ( _pos_error . z ) ;
2013-12-28 07:15:29 -04:00
}
} else {
2013-12-28 10:04:45 -04:00
_vel_target . z = 0 ;
2013-12-28 07:15:29 -04:00
}
// call rate based throttle controller which will update accel based throttle controller targets
2014-05-31 10:35:14 -03:00
rate_to_accel_z ( ) ;
2013-12-28 10:04:45 -04:00
}
2013-12-28 07:15:29 -04:00
2013-12-28 10:04:45 -04:00
// rate_to_accel_z - calculates desired accel required to achieve the velocity target
// calculates desired acceleration and calls accel throttle controller
2014-05-31 10:35:14 -03:00
void AC_PosControl : : rate_to_accel_z ( )
2013-12-28 10:04:45 -04:00
{
const Vector3f & curr_vel = _inav . get_velocity ( ) ;
float p ; // used to capture pid values for logging
float desired_accel ; // the target acceleration if the accel based throttle is enabled, otherwise the output to be sent to the motors
// check speed limits
// To-Do: check these speed limits here or in the pos->rate controller
_limit . vel_up = false ;
_limit . vel_down = false ;
2014-01-17 22:53:46 -04:00
if ( _vel_target . z < _speed_down_cms ) {
_vel_target . z = _speed_down_cms ;
2013-12-28 10:04:45 -04:00
_limit . vel_down = true ;
}
2014-01-17 22:53:46 -04:00
if ( _vel_target . z > _speed_up_cms ) {
_vel_target . z = _speed_up_cms ;
2013-12-28 10:04:45 -04:00
_limit . vel_up = true ;
}
2014-05-31 10:35:14 -03:00
// reset last velocity target to current target
if ( _flags . reset_rate_to_accel_z ) {
_vel_last . z = _vel_target . z ;
_flags . reset_rate_to_accel_z = false ;
}
// feed forward desired acceleration calculation
if ( _dt > 0.0f ) {
2014-06-06 01:30:45 -03:00
if ( ! _flags . freeze_ff_z ) {
2014-05-31 10:35:14 -03:00
_accel_feedforward . z = ( _vel_target . z - _vel_last . z ) / _dt ;
} else {
2014-05-31 22:48:43 -03:00
// stop the feed forward being calculated during a known discontinuity
2014-06-06 01:30:45 -03:00
_flags . freeze_ff_z = false ;
2014-05-31 10:35:14 -03:00
}
} else {
_accel_feedforward . z = 0.0f ;
}
// store this iteration's velocities for the next iteration
_vel_last . z = _vel_target . z ;
2013-12-28 10:04:45 -04:00
// reset velocity error and filter if this controller has just been engaged
2014-05-02 00:08:18 -03:00
if ( _flags . reset_rate_to_accel_z ) {
2013-12-28 10:04:45 -04:00
// Reset Filter
_vel_error . z = 0 ;
desired_accel = 0 ;
2014-05-02 00:08:18 -03:00
_flags . reset_rate_to_accel_z = false ;
2013-12-28 10:04:45 -04:00
} else {
2014-05-31 10:35:14 -03:00
_vel_error . z = ( _vel_target . z - curr_vel . z ) ;
2013-12-28 10:04:45 -04:00
}
// calculate p
2014-02-15 11:00:41 -04:00
p = _p_alt_rate . kP ( ) * _vel_error . z ;
2013-12-28 10:04:45 -04:00
// consolidate and constrain target acceleration
2014-05-31 10:35:14 -03:00
desired_accel = _accel_feedforward . z + p ;
2013-12-28 10:04:45 -04:00
desired_accel = constrain_int32 ( desired_accel , - 32000 , 32000 ) ;
// set target for accel based throttle controller
accel_to_throttle ( desired_accel ) ;
2013-12-28 07:15:29 -04:00
}
2013-12-28 10:04:45 -04:00
// accel_to_throttle - alt hold's acceleration controller
// calculates a desired throttle which is sent directly to the motors
void AC_PosControl : : accel_to_throttle ( float accel_target_z )
{
float z_accel_meas ; // actual acceleration
int32_t p , i , d ; // used to capture pid values for logging
// Calculate Earth Frame Z acceleration
z_accel_meas = - ( _ahrs . get_accel_ef ( ) . z + GRAVITY_MSS ) * 100.0f ;
// reset target altitude if this controller has just been engaged
2014-05-02 00:08:18 -03:00
if ( _flags . reset_accel_to_throttle ) {
2013-12-28 10:04:45 -04:00
// Reset Filter
_accel_error . z = 0 ;
2014-05-02 00:08:18 -03:00
_flags . reset_accel_to_throttle = false ;
2013-12-28 10:04:45 -04:00
} else {
// calculate accel error and Filter with fc = 2 Hz
// To-Do: replace constant below with one that is adjusted for update rate
_accel_error . z = _accel_error . z + 0.11164f * ( constrain_float ( accel_target_z - z_accel_meas , - 32000 , 32000 ) - _accel_error . z ) ;
}
// separately calculate p, i, d values for logging
p = _pid_alt_accel . get_p ( _accel_error . z ) ;
// get i term
i = _pid_alt_accel . get_integrator ( ) ;
// update i term as long as we haven't breached the limits or the I term will certainly reduce
// To-Do: should this be replaced with limits check from attitude_controller?
if ( ( ! _motors . limit . throttle_lower & & ! _motors . limit . throttle_upper ) | | ( i > 0 & & _accel_error . z < 0 ) | | ( i < 0 & & _accel_error . z > 0 ) ) {
i = _pid_alt_accel . get_i ( _accel_error . z , _dt ) ;
}
// get d term
d = _pid_alt_accel . get_d ( _accel_error . z , _dt ) ;
// To-Do: pull min/max throttle from motors
// To-Do: we had a contraint here but it's now removed, is this ok? with the motors library handle it ok?
_attitude_control . set_throttle_out ( ( int16_t ) p + i + d + _throttle_hover , true ) ;
2014-01-05 23:30:51 -04:00
2013-12-28 10:04:45 -04:00
// to-do add back in PID logging?
}
2013-12-28 07:15:29 -04:00
2014-01-23 23:27:06 -04:00
///
/// position controller
///
2013-12-28 07:15:29 -04:00
2014-01-23 23:27:06 -04:00
/// set_accel_xy - set horizontal acceleration in cm/s/s
/// calc_leash_length_xy should be called afterwards
void AC_PosControl : : set_accel_xy ( float accel_cmss )
2013-12-28 07:15:29 -04:00
{
2014-01-23 23:27:06 -04:00
if ( fabs ( _accel_cms - accel_cmss ) > 1.0f ) {
_accel_cms = accel_cmss ;
_flags . recalc_leash_xy = true ;
2013-12-28 07:15:29 -04:00
}
2014-01-23 23:27:06 -04:00
}
2013-12-28 07:15:29 -04:00
2014-01-23 23:27:06 -04:00
/// set_speed_xy - set horizontal speed maximum in cm/s
/// calc_leash_length_xy should be called afterwards
void AC_PosControl : : set_speed_xy ( float speed_cms )
{
if ( fabs ( _speed_cms - speed_cms ) > 1.0f ) {
_speed_cms = speed_cms ;
_flags . recalc_leash_xy = true ;
2013-12-28 07:15:29 -04:00
}
}
2014-01-17 22:53:46 -04:00
/// set_pos_target in cm from home
void AC_PosControl : : set_pos_target ( const Vector3f & position )
{
_pos_target = position ;
// initialise roll and pitch to current roll and pitch. This avoids a twitch between when the target is set and the pos controller is first run
2014-01-23 23:27:06 -04:00
// To-Do: this initialisation of roll and pitch targets needs to go somewhere between when pos-control is initialised and when it completes it's first cycle
//_roll_target = constrain_int32(_ahrs.roll_sensor,-_attitude_control.lean_angle_max(),_attitude_control.lean_angle_max());
//_pitch_target = constrain_int32(_ahrs.pitch_sensor,-_attitude_control.lean_angle_max(),_attitude_control.lean_angle_max());
2014-01-17 22:53:46 -04:00
}
2014-05-06 05:32:30 -03:00
/// set_xy_target in cm from home
void AC_PosControl : : set_xy_target ( float x , float y )
{
_pos_target . x = x ;
_pos_target . y = y ;
}
2014-04-30 09:22:47 -03:00
/// set_target_to_stopping_point_xy - sets horizontal target to reasonable stopping position in cm from home
void AC_PosControl : : set_target_to_stopping_point_xy ( )
{
// check if xy leash needs to be recalculated
calc_leash_length_xy ( ) ;
get_stopping_point_xy ( _pos_target ) ;
}
2014-01-17 22:53:46 -04:00
/// get_stopping_point_xy - calculates stopping point based on current position, velocity, vehicle acceleration
/// distance_max allows limiting distance to stopping point
/// results placed in stopping_position vector
/// set_accel_xy() should be called before this method to set vehicle acceleration
/// set_leash_length() should have been called before this method
void AC_PosControl : : get_stopping_point_xy ( Vector3f & stopping_point ) const
2013-12-28 07:15:29 -04:00
{
2014-05-06 08:40:45 -03:00
const Vector3f curr_pos = _inav . get_position ( ) ;
2014-01-17 22:53:46 -04:00
Vector3f curr_vel = _inav . get_velocity ( ) ;
float linear_distance ; // the distance at which we swap from a linear to sqrt response
float linear_velocity ; // the velocity above which we swap from a linear to sqrt response
float stopping_dist ; // the distance within the vehicle can stop
2014-02-14 03:05:29 -04:00
float kP = _p_pos_xy . kP ( ) ;
2013-12-28 07:15:29 -04:00
2014-05-06 05:32:30 -03:00
// add velocity error to current velocity
if ( is_active_xy ( ) ) {
curr_vel . x + = _vel_error . x ;
curr_vel . y + = _vel_error . y ;
}
2013-12-28 07:15:29 -04:00
// calculate current velocity
2014-04-01 08:40:08 -03:00
float vel_total = pythagorous2 ( curr_vel . x , curr_vel . y ) ;
2013-12-28 07:15:29 -04:00
// avoid divide by zero by using current position if the velocity is below 10cm/s, kP is very low or acceleration is zero
2014-05-06 05:32:30 -03:00
if ( kP < = 0.0f | | _accel_cms < = 0.0f ) {
2014-04-30 09:22:47 -03:00
stopping_point . x = curr_pos . x ;
stopping_point . y = curr_pos . y ;
2013-12-28 07:15:29 -04:00
return ;
}
// calculate point at which velocity switches from linear to sqrt
2014-01-17 22:53:46 -04:00
linear_velocity = _accel_cms / kP ;
2013-12-28 07:15:29 -04:00
// calculate distance within which we can stop
if ( vel_total < linear_velocity ) {
2014-01-17 22:53:46 -04:00
stopping_dist = vel_total / kP ;
2013-12-28 07:15:29 -04:00
} else {
2014-01-17 22:53:46 -04:00
linear_distance = _accel_cms / ( 2.0f * kP * kP ) ;
stopping_dist = linear_distance + ( vel_total * vel_total ) / ( 2.0f * _accel_cms ) ;
2013-12-28 07:15:29 -04:00
}
2014-01-17 22:53:46 -04:00
// constrain stopping distance
stopping_dist = constrain_float ( stopping_dist , 0 , _leash ) ;
2013-12-28 07:15:29 -04:00
2014-01-17 22:53:46 -04:00
// convert the stopping distance into a stopping point using velocity vector
stopping_point . x = curr_pos . x + ( stopping_dist * curr_vel . x / vel_total ) ;
stopping_point . y = curr_pos . y + ( stopping_dist * curr_vel . y / vel_total ) ;
2013-12-28 07:15:29 -04:00
}
/// get_distance_to_target - get horizontal distance to loiter target in cm
float AC_PosControl : : get_distance_to_target ( ) const
{
return _distance_to_target ;
}
2014-05-06 05:32:30 -03:00
// is_active_xy - returns true if the xy position controller has been run very recently
bool AC_PosControl : : is_active_xy ( ) const
{
return ( ( hal . scheduler - > millis ( ) - _last_update_xy_ms ) < = POSCONTROL_ACTIVE_TIMEOUT_MS ) ;
}
/// init_xy_controller - initialise the xy controller
2014-05-06 23:46:39 -03:00
/// sets target roll angle, pitch angle and I terms based on vehicle current lean angles
/// should be called once whenever significant changes to the position target are made
/// this does not update the xy target
2014-05-06 05:32:30 -03:00
void AC_PosControl : : init_xy_controller ( )
{
// reset xy controller to first step
_xy_step = 0 ;
// set roll, pitch lean angle targets to current attitude
_roll_target = _ahrs . roll_sensor ;
_pitch_target = _ahrs . pitch_sensor ;
2014-05-06 23:46:39 -03:00
// initialise I terms from lean angles
2014-05-06 05:32:30 -03:00
if ( ! _flags . keep_xy_I_terms ) {
2014-05-06 23:46:39 -03:00
// reset last velocity if this controller has just been engaged or dt is zero
lean_angles_to_accel ( _accel_target . x , _accel_target . y ) ;
_pid_rate_lat . set_integrator ( _accel_target . x ) ;
_pid_rate_lon . set_integrator ( _accel_target . y ) ;
2014-05-06 05:32:30 -03:00
} else {
// reset keep_xy_I_term flag in case it has been set
_flags . keep_xy_I_terms = false ;
}
// flag reset required in rate to accel step
_flags . reset_desired_vel_to_pos = true ;
_flags . reset_rate_to_accel_xy = true ;
// update update time
_last_update_xy_ms = hal . scheduler - > millis ( ) ;
}
2014-04-19 04:40:47 -03:00
/// update_xy_controller - run the horizontal position controller - should be called at 100hz or higher
2014-04-23 02:40:06 -03:00
void AC_PosControl : : update_xy_controller ( bool use_desired_velocity )
2013-12-28 07:15:29 -04:00
{
// catch if we've just been started
2014-01-17 22:53:46 -04:00
uint32_t now = hal . scheduler - > millis ( ) ;
2014-05-02 00:08:18 -03:00
if ( ( now - _last_update_xy_ms ) > = POSCONTROL_ACTIVE_TIMEOUT_MS ) {
2014-05-06 05:32:30 -03:00
init_xy_controller ( ) ;
2013-12-28 07:15:29 -04:00
}
2014-01-23 23:27:06 -04:00
// check if xy leash needs to be recalculated
calc_leash_length_xy ( ) ;
2014-01-17 22:53:46 -04:00
// reset step back to 0 if loiter or waypoint parents have triggered an update and we completed the last full cycle
if ( _flags . force_recalc_xy & & _xy_step > 3 ) {
_flags . force_recalc_xy = false ;
_xy_step = 0 ;
2013-12-28 07:15:29 -04:00
}
// run loiter steps
2014-01-17 22:53:46 -04:00
switch ( _xy_step ) {
2013-12-28 07:15:29 -04:00
case 0 :
// capture time since last iteration
2014-05-02 00:08:18 -03:00
_dt_xy = ( now - _last_update_xy_ms ) / 1000.0f ;
_last_update_xy_ms = now ;
2013-12-28 07:15:29 -04:00
// translate any adjustments from pilot to loiter target
2014-01-17 22:53:46 -04:00
desired_vel_to_pos ( _dt_xy ) ;
_xy_step + + ;
2013-12-28 07:15:29 -04:00
break ;
case 1 :
2014-01-17 22:53:46 -04:00
// run position controller's position error to desired velocity step
pos_to_rate_xy ( use_desired_velocity , _dt_xy ) ;
_xy_step + + ;
2013-12-28 07:15:29 -04:00
break ;
case 2 :
2014-01-17 22:53:46 -04:00
// run position controller's velocity to acceleration step
rate_to_accel_xy ( _dt_xy ) ;
_xy_step + + ;
2013-12-28 07:15:29 -04:00
break ;
case 3 :
2014-01-17 22:53:46 -04:00
// run position controller's acceleration to lean angle step
accel_to_lean_angles ( ) ;
_xy_step + + ;
2013-12-28 07:15:29 -04:00
break ;
}
}
2014-01-17 22:53:46 -04:00
///
/// private methods
///
2013-12-28 07:15:29 -04:00
2014-01-23 23:27:06 -04:00
/// calc_leash_length - calculates the horizontal leash length given a maximum speed, acceleration
/// should be called whenever the speed, acceleration or position kP is modified
void AC_PosControl : : calc_leash_length_xy ( )
{
if ( _flags . recalc_leash_xy ) {
2014-02-14 03:05:29 -04:00
_leash = calc_leash_length ( _speed_cms , _accel_cms , _p_pos_xy . kP ( ) ) ;
2014-01-23 23:27:06 -04:00
_flags . recalc_leash_xy = false ;
}
}
2014-01-17 22:53:46 -04:00
/// desired_vel_to_pos - move position target using desired velocities
void AC_PosControl : : desired_vel_to_pos ( float nav_dt )
{
// range check nav_dt
if ( nav_dt < 0 ) {
2013-12-28 07:15:29 -04:00
return ;
}
2014-01-17 22:53:46 -04:00
// update target position
2014-05-06 05:32:30 -03:00
if ( _flags . reset_desired_vel_to_pos ) {
_flags . reset_desired_vel_to_pos = false ;
} else {
_pos_target . x + = _vel_desired . x * nav_dt ;
_pos_target . y + = _vel_desired . y * nav_dt ;
}
2013-12-28 07:15:29 -04:00
}
2014-01-17 22:53:46 -04:00
/// pos_to_rate_xy - horizontal position error to velocity controller
/// converts position (_pos_target) to target velocity (_vel_target)
/// when use_desired_rate is set to true:
/// desired velocity (_vel_desired) is combined into final target velocity and
/// velocity due to position error is reduce to a maximum of 1m/s
void AC_PosControl : : pos_to_rate_xy ( bool use_desired_rate , float dt )
2013-12-28 07:15:29 -04:00
{
2014-01-17 22:53:46 -04:00
Vector3f curr_pos = _inav . get_position ( ) ;
float linear_distance ; // the distance we swap between linear and sqrt velocity response
2014-02-14 03:05:29 -04:00
float kP = _p_pos_xy . kP ( ) ;
2013-12-28 07:15:29 -04:00
// avoid divide by zero
if ( kP < = 0.0f ) {
2014-01-17 22:53:46 -04:00
_vel_target . x = 0.0 ;
_vel_target . y = 0.0 ;
2013-12-28 07:15:29 -04:00
} else {
// calculate distance error
2014-01-17 22:53:46 -04:00
_pos_error . x = _pos_target . x - curr_pos . x ;
_pos_error . y = _pos_target . y - curr_pos . y ;
// constrain target position to within reasonable distance of current location
2014-04-01 08:40:08 -03:00
_distance_to_target = pythagorous2 ( _pos_error . x , _pos_error . y ) ;
2014-01-17 22:53:46 -04:00
if ( _distance_to_target > _leash & & _distance_to_target > 0.0f ) {
_pos_target . x = curr_pos . x + _leash * _pos_error . x / _distance_to_target ;
_pos_target . y = curr_pos . y + _leash * _pos_error . y / _distance_to_target ;
// re-calculate distance error
_pos_error . x = _pos_target . x - curr_pos . x ;
_pos_error . y = _pos_target . y - curr_pos . y ;
_distance_to_target = _leash ;
}
2013-12-28 07:15:29 -04:00
2014-01-17 22:53:46 -04:00
// calculate the distance at which we swap between linear and sqrt velocity response
linear_distance = _accel_cms / ( 2.0f * kP * kP ) ;
2013-12-28 07:15:29 -04:00
2014-01-17 22:53:46 -04:00
if ( _distance_to_target > 2.0f * linear_distance ) {
// velocity response grows with the square root of the distance
float vel_sqrt = safe_sqrt ( 2.0f * _accel_cms * ( _distance_to_target - linear_distance ) ) ;
_vel_target . x = vel_sqrt * _pos_error . x / _distance_to_target ;
_vel_target . y = vel_sqrt * _pos_error . y / _distance_to_target ;
} else {
// velocity response grows linearly with the distance
2014-02-14 03:05:29 -04:00
_vel_target . x = _p_pos_xy . kP ( ) * _pos_error . x ;
_vel_target . y = _p_pos_xy . kP ( ) * _pos_error . y ;
2014-01-17 22:53:46 -04:00
}
2013-12-28 07:15:29 -04:00
2014-01-17 22:53:46 -04:00
// decide velocity limit due to position error
float vel_max_from_pos_error ;
if ( use_desired_rate ) {
// if desired velocity (i.e. velocity feed forward) is being used we limit the maximum velocity correction due to position error to 2m/s
vel_max_from_pos_error = POSCONTROL_VEL_XY_MAX_FROM_POS_ERR ;
2013-12-28 07:15:29 -04:00
} else {
2014-01-17 22:53:46 -04:00
// if desired velocity is not used, we allow position error to increase speed up to maximum speed
vel_max_from_pos_error = _speed_cms ;
2013-12-28 07:15:29 -04:00
}
2014-01-17 22:53:46 -04:00
// scale velocity to stays within limits
2014-04-01 08:40:08 -03:00
float vel_total = pythagorous2 ( _vel_target . x , _vel_target . y ) ;
2014-01-17 22:53:46 -04:00
if ( vel_total > vel_max_from_pos_error ) {
_vel_target . x = vel_max_from_pos_error * _vel_target . x / vel_total ;
_vel_target . y = vel_max_from_pos_error * _vel_target . y / vel_total ;
2013-12-28 07:15:29 -04:00
}
2014-01-17 22:53:46 -04:00
// add desired velocity (i.e. feed forward).
if ( use_desired_rate ) {
_vel_target . x + = _vel_desired . x ;
_vel_target . y + = _vel_desired . y ;
}
2013-12-28 07:15:29 -04:00
}
}
2014-01-17 22:53:46 -04:00
/// rate_to_accel_xy - horizontal desired rate to desired acceleration
2013-12-28 07:15:29 -04:00
/// converts desired velocities in lat/lon directions to accelerations in lat/lon frame
2014-01-17 22:53:46 -04:00
void AC_PosControl : : rate_to_accel_xy ( float dt )
2013-12-28 07:15:29 -04:00
{
2014-01-17 22:53:46 -04:00
const Vector3f & vel_curr = _inav . get_velocity ( ) ; // current velocity in cm/s
2013-12-28 07:15:29 -04:00
float accel_total ; // total acceleration in cm/s/s
2014-04-22 10:33:48 -03:00
float lat_i , lon_i ;
2014-01-17 22:53:46 -04:00
2014-05-06 05:32:30 -03:00
// reset last velocity target to current target
if ( _flags . reset_rate_to_accel_xy ) {
_vel_last . x = _vel_target . x ;
_vel_last . y = _vel_target . y ;
_flags . reset_rate_to_accel_xy = false ;
}
// feed forward desired acceleration calculation
if ( dt > 0.0f ) {
2014-06-06 01:30:45 -03:00
if ( ! _flags . freeze_ff_xy ) {
2014-05-31 10:35:14 -03:00
_accel_feedforward . x = ( _vel_target . x - _vel_last . x ) / dt ;
_accel_feedforward . y = ( _vel_target . y - _vel_last . y ) / dt ;
} else {
2014-05-31 22:48:43 -03:00
// stop the feed forward being calculated during a known discontinuity
2014-06-06 01:30:45 -03:00
_flags . freeze_ff_xy = false ;
2014-05-31 10:35:14 -03:00
}
2014-05-06 05:32:30 -03:00
} else {
2014-05-31 10:35:14 -03:00
_accel_feedforward . x = 0.0f ;
_accel_feedforward . y = 0.0f ;
2013-12-28 07:15:29 -04:00
}
// store this iteration's velocities for the next iteration
2014-01-17 22:53:46 -04:00
_vel_last . x = _vel_target . x ;
_vel_last . y = _vel_target . y ;
2013-12-28 07:15:29 -04:00
// calculate velocity error
2014-01-17 22:53:46 -04:00
_vel_error . x = _vel_target . x - vel_curr . x ;
_vel_error . y = _vel_target . y - vel_curr . y ;
2013-12-28 07:15:29 -04:00
2014-04-22 10:33:48 -03:00
// get current i term
lat_i = _pid_rate_lat . get_integrator ( ) ;
lon_i = _pid_rate_lon . get_integrator ( ) ;
// update i term if we have not hit the accel or throttle limits OR the i term will reduce
if ( ( ! _limit . accel_xy & & ! _motors . limit . throttle_upper ) | | ( ( lat_i > 0 & & _vel_error . x < 0 ) | | ( lat_i < 0 & & _vel_error . x > 0 ) ) ) {
lat_i = _pid_rate_lat . get_i ( _vel_error . x , dt ) ;
}
if ( ( ! _limit . accel_xy & & ! _motors . limit . throttle_upper ) | | ( ( lon_i > 0 & & _vel_error . y < 0 ) | | ( lon_i < 0 & & _vel_error . y > 0 ) ) ) {
2014-04-22 23:16:41 -03:00
lon_i = _pid_rate_lon . get_i ( _vel_error . y , dt ) ;
2014-04-22 10:33:48 -03:00
}
2014-03-16 21:40:11 -03:00
// combine feed forward accel with PID output from velocity error
2014-05-31 10:35:14 -03:00
_accel_target . x = _accel_feedforward . x + _pid_rate_lat . get_p ( _vel_error . x ) + lat_i + _pid_rate_lat . get_d ( _vel_error . x , dt ) ;
_accel_target . y = _accel_feedforward . y + _pid_rate_lon . get_p ( _vel_error . y ) + lon_i + _pid_rate_lon . get_d ( _vel_error . y , dt ) ;
2013-12-28 07:15:29 -04:00
// scale desired acceleration if it's beyond acceptable limit
2014-01-17 22:53:46 -04:00
// To-Do: move this check down to the accel_to_lean_angle method?
2014-04-01 08:40:08 -03:00
accel_total = pythagorous2 ( _accel_target . x , _accel_target . y ) ;
2014-05-06 05:32:30 -03:00
if ( accel_total > POSCONTROL_ACCEL_XY_MAX & & accel_total > 0.0f ) {
2014-01-17 22:53:46 -04:00
_accel_target . x = POSCONTROL_ACCEL_XY_MAX * _accel_target . x / accel_total ;
_accel_target . y = POSCONTROL_ACCEL_XY_MAX * _accel_target . y / accel_total ;
_limit . accel_xy = true ; // unused
2014-04-22 10:33:48 -03:00
} else {
// reset accel limit flag
_limit . accel_xy = false ;
2013-12-28 07:15:29 -04:00
}
}
2014-01-17 22:53:46 -04:00
/// accel_to_lean_angles - horizontal desired acceleration to lean angles
2013-12-28 07:15:29 -04:00
/// converts desired accelerations provided in lat/lon frame to roll/pitch angles
2014-01-17 22:53:46 -04:00
void AC_PosControl : : accel_to_lean_angles ( )
2013-12-28 07:15:29 -04:00
{
2014-01-17 22:53:46 -04:00
float accel_right , accel_forward ;
float lean_angle_max = _attitude_control . lean_angle_max ( ) ;
2013-12-28 07:15:29 -04:00
// To-Do: add 1hz filter to accel_lat, accel_lon
// rotate accelerations into body forward-right frame
2014-02-08 23:34:59 -04:00
accel_forward = _accel_target . x * _ahrs . cos_yaw ( ) + _accel_target . y * _ahrs . sin_yaw ( ) ;
accel_right = - _accel_target . x * _ahrs . sin_yaw ( ) + _accel_target . y * _ahrs . cos_yaw ( ) ;
2013-12-28 07:15:29 -04:00
// update angle targets that will be passed to stabilize controller
2014-02-08 23:34:59 -04:00
_roll_target = constrain_float ( fast_atan ( accel_right * _ahrs . cos_pitch ( ) / ( GRAVITY_MSS * 100 ) ) * ( 18000 / M_PI ) , - lean_angle_max , lean_angle_max ) ;
2014-01-21 23:55:28 -04:00
_pitch_target = constrain_float ( fast_atan ( - accel_forward / ( GRAVITY_MSS * 100 ) ) * ( 18000 / M_PI ) , - lean_angle_max , lean_angle_max ) ;
2013-12-28 07:15:29 -04:00
}
2014-05-06 05:32:30 -03:00
// get_lean_angles_to_accel - convert roll, pitch lean angles to lat/lon frame accelerations in cm/s/s
2014-05-06 08:40:45 -03:00
void AC_PosControl : : lean_angles_to_accel ( float & accel_x_cmss , float & accel_y_cmss ) const
2014-05-06 05:32:30 -03:00
{
// rotate our roll, pitch angles into lat/lon frame
accel_x_cmss = ( GRAVITY_MSS * 100 ) * ( - ( _ahrs . cos_yaw ( ) * _ahrs . sin_pitch ( ) / max ( _ahrs . cos_pitch ( ) , 0.5 ) ) - _ahrs . sin_yaw ( ) * _ahrs . sin_roll ( ) / max ( _ahrs . cos_roll ( ) , 0.5 ) ) ;
accel_y_cmss = ( GRAVITY_MSS * 100 ) * ( - ( _ahrs . sin_yaw ( ) * _ahrs . sin_pitch ( ) / max ( _ahrs . cos_pitch ( ) , 0.5 ) ) + _ahrs . cos_yaw ( ) * _ahrs . sin_roll ( ) / max ( _ahrs . cos_roll ( ) , 0.5 ) ) ;
}
2014-01-17 22:53:46 -04:00
/// calc_leash_length - calculates the horizontal leash length given a maximum speed, acceleration and position kP gain
float AC_PosControl : : calc_leash_length ( float speed_cms , float accel_cms , float kP ) const
2013-12-28 07:15:29 -04:00
{
2014-01-17 22:53:46 -04:00
float leash_length ;
2013-12-28 07:15:29 -04:00
2014-01-17 22:53:46 -04:00
// sanity check acceleration and avoid divide by zero
if ( accel_cms < = 0.0f ) {
accel_cms = POSCONTROL_ACCELERATION_MIN ;
}
// avoid divide by zero
if ( kP < = 0.0f ) {
return POSCONTROL_LEASH_LENGTH_MIN ;
}
// calculate leash length
if ( speed_cms < = accel_cms / kP ) {
// linear leash length based on speed close in
leash_length = speed_cms / kP ;
} else {
// leash length grows at sqrt of speed further out
leash_length = ( accel_cms / ( 2.0f * kP * kP ) ) + ( speed_cms * speed_cms / ( 2.0f * accel_cms ) ) ;
}
// ensure leash is at least 1m long
if ( leash_length < POSCONTROL_LEASH_LENGTH_MIN ) {
leash_length = POSCONTROL_LEASH_LENGTH_MIN ;
}
return leash_length ;
2013-12-28 07:15:29 -04:00
}