2013-03-20 03:27:26 -03:00
/// -*- tab-width: 4; Mode: C++; c-basic-offset: 4; indent-tabs-mode: nil -*-
# ifndef AC_WPNAV_H
# define AC_WPNAV_H
# include <inttypes.h>
# include <AP_Common.h>
# include <AP_Param.h>
# include <AP_Math.h>
# include <AC_PID.h> // PID library
# include <APM_PI.h> // PID library
# include <AP_InertialNav.h> // Inertial Navigation library
// loiter maximum velocities and accelerations
2013-07-07 22:58:33 -03:00
# define WPNAV_ACCELERATION 100.0f // defines the default velocity vs distant curve. maximum acceleration in cm/s/s that position controller asks for from acceleration controller
2013-06-15 23:39:54 -03:00
# define WPNAV_ACCELERATION_MIN 50.0f // minimum acceleration in cm/s/s - used for sanity checking _wp_accel parameter
2013-05-31 09:03:27 -03:00
# define WPNAV_ACCEL_MAX 980.0f // max acceleration in cm/s/s that the loiter velocity controller will ask from the lower accel controller.
2013-05-24 11:45:03 -03:00
// should be 1.5 times larger than WPNAV_ACCELERATION.
2013-04-02 11:22:09 -03:00
// max acceleration = max lean angle * 980 * pi / 180. i.e. 23deg * 980 * 3.141 / 180 = 393 cm/s/s
2013-04-06 10:25:58 -03:00
2013-07-07 22:58:33 -03:00
# define WPNAV_LOITER_SPEED 500.0f // maximum default loiter speed in cm/s
# define WPNAV_LOITER_ACCEL_MAX 250.0f // maximum acceleration in loiter mode
2013-05-24 11:45:03 -03:00
# define WPNAV_LOITER_ACCEL_MIN 25.0f // minimum acceleration in loiter mode
2013-07-10 03:34:15 -03:00
# define WPNAV_LOITER_SPEED_MAX_TO_CORRECT_ERROR 200.0f // maximum speed used to correct position error (i.e. not including feed forward)
2013-05-24 11:45:03 -03:00
2013-04-01 03:45:23 -03:00
# define MAX_LEAN_ANGLE 4500 // default maximum lean angle
2013-03-20 03:27:26 -03:00
2013-04-18 02:51:01 -03:00
# define WPNAV_WP_SPEED 500.0f // default horizontal speed betwen waypoints in cm/s
# define WPNAV_WP_RADIUS 200.0f // default waypoint radius in cm
# define WPNAV_WP_SPEED_UP 250.0f // default maximum climb velocity
2013-04-18 10:32:00 -03:00
# define WPNAV_WP_SPEED_DOWN 150.0f // default maximum descent velocity
2013-04-18 02:51:01 -03:00
2013-07-07 22:58:33 -03:00
# define WPNAV_ALT_HOLD_P 1.0f // default throttle controller's altitude hold's P gain.
2013-05-31 09:03:27 -03:00
# define WPNAV_ALT_HOLD_ACCEL_MAX 250.0f // hard coded copy of throttle controller's maximum acceleration in cm/s. To-Do: remove duplication with throttle controller definition
2013-04-06 10:25:58 -03:00
2013-05-14 23:51:26 -03:00
# define WPNAV_MIN_LEASH_LENGTH 100.0f // minimum leash lengths in cm
2013-03-20 03:27:26 -03:00
class AC_WPNav
{
public :
/// Constructor
2013-05-09 06:32:02 -03:00
AC_WPNav ( AP_InertialNav * inav , AP_AHRS * ahrs , APM_PI * pid_pos_lat , APM_PI * pid_pos_lon , AC_PID * pid_rate_lat , AC_PID * pid_rate_lon ) ;
2013-03-20 03:27:26 -03:00
///
/// simple loiter controller
///
2013-03-20 10:28:05 -03:00
/// get_loiter_target - get loiter target as position vector (from home in cm)
2013-04-21 07:54:31 -03:00
const Vector3f & get_loiter_target ( ) const { return _target ; }
2013-03-20 10:28:05 -03:00
2013-03-20 03:27:26 -03:00
/// set_loiter_target in cm from home
2013-05-25 02:07:04 -03:00
void set_loiter_target ( const Vector3f & position ) ;
2013-03-20 03:27:26 -03:00
2013-06-15 06:14:36 -03:00
/// init_loiter_target - set initial loiter target based on current position and velocity
void init_loiter_target ( const Vector3f & position , const Vector3f & velocity ) ;
2013-03-27 02:10:02 -03:00
2013-04-02 11:22:09 -03:00
/// move_loiter_target - move destination using pilot input
void move_loiter_target ( float control_roll , float control_pitch , float dt ) ;
2013-03-20 03:27:26 -03:00
2013-03-20 10:28:05 -03:00
/// get_distance_to_target - get horizontal distance to loiter target in cm
2013-04-21 07:54:31 -03:00
float get_distance_to_target ( ) const ;
2013-03-20 10:28:05 -03:00
/// get_bearing_to_target - get bearing to loiter target in centi-degrees
2013-04-21 07:54:31 -03:00
int32_t get_bearing_to_target ( ) const ;
2013-03-20 10:28:05 -03:00
/// update_loiter - run the loiter controller - should be called at 10hz
void update_loiter ( ) ;
2013-05-11 04:05:42 -03:00
/// get_stopping_point - returns vector to stopping point based on a horizontal position and velocity
void get_stopping_point ( const Vector3f & position , const Vector3f & velocity , Vector3f & target ) const ;
2013-03-20 03:27:26 -03:00
///
2013-04-08 23:50:12 -03:00
/// waypoint controller
2013-03-20 03:27:26 -03:00
///
2013-03-27 11:07:33 -03:00
/// get_destination waypoint using position vector (distance from home in cm)
2013-04-21 07:54:31 -03:00
const Vector3f & get_destination ( ) const { return _destination ; }
2013-03-27 11:07:33 -03:00
2013-03-20 10:28:05 -03:00
/// set_destination waypoint using position vector (distance from home in cm)
2013-03-20 03:27:26 -03:00
void set_destination ( const Vector3f & destination ) ;
2013-03-20 10:28:05 -03:00
/// set_origin_and_destination - set origin and destination waypoints using position vectors (distance from home in cm)
2013-03-20 03:27:26 -03:00
void set_origin_and_destination ( const Vector3f & origin , const Vector3f & destination ) ;
/// advance_target_along_track - move target location along track from origin to destination
2013-04-29 22:20:23 -03:00
void advance_target_along_track ( float dt ) ;
2013-03-20 03:27:26 -03:00
2013-03-20 10:28:05 -03:00
/// get_distance_to_destination - get horizontal distance to destination in cm
float get_distance_to_destination ( ) ;
/// get_bearing_to_destination - get bearing to next waypoint in centi-degrees
int32_t get_bearing_to_destination ( ) ;
2013-04-08 23:50:12 -03:00
/// reached_destination - true when we have come within RADIUS cm of the waypoint
2013-05-08 12:18:02 -03:00
bool reached_destination ( ) const { return _flags . reached_destination ; }
/// set_fast_waypoint - set to true to ignore the waypoint radius and consider the waypoint 'reached' the moment the intermediate point reaches it
void set_fast_waypoint ( bool fast ) { _flags . fast_waypoint = fast ; }
2013-04-08 23:50:12 -03:00
2013-03-20 10:28:05 -03:00
/// update_wp - update waypoint controller
void update_wpnav ( ) ;
2013-03-20 03:27:26 -03:00
///
/// shared methods
///
2013-04-08 23:50:12 -03:00
/// get desired roll, pitch which should be fed into stabilize controllers
2013-04-21 07:54:31 -03:00
int32_t get_desired_roll ( ) const { return _desired_roll ; } ;
int32_t get_desired_pitch ( ) const { return _desired_pitch ; } ;
2013-03-20 03:27:26 -03:00
2013-04-08 23:50:12 -03:00
/// get_desired_alt - get desired altitude (in cm above home) from loiter or wp controller which should be fed into throttle controller
2013-04-21 07:54:31 -03:00
float get_desired_alt ( ) const { return _target . z ; }
2013-04-08 23:50:12 -03:00
/// set_desired_alt - set desired altitude (in cm above home)
2013-04-08 23:58:18 -03:00
void set_desired_alt ( float desired_alt ) { _target . z = desired_alt ; }
2013-03-20 03:27:26 -03:00
/// set_cos_sin_yaw - short-cut to save on calculations to convert from roll-pitch frame to lat-lon frame
2013-04-21 04:27:50 -03:00
void set_cos_sin_yaw ( float cos_yaw , float sin_yaw , float cos_pitch ) {
2013-03-20 03:27:26 -03:00
_cos_yaw = cos_yaw ;
_sin_yaw = sin_yaw ;
2013-04-21 04:27:50 -03:00
_cos_pitch = cos_pitch ;
2013-03-20 03:27:26 -03:00
}
2013-05-31 09:03:27 -03:00
/// set_althold_kP - pass in alt hold controller's P gain
void set_althold_kP ( float kP ) { if ( kP > 0.0 ) _althold_kP = kP ; }
2013-04-14 01:24:14 -03:00
/// set_horizontal_velocity - allows main code to pass target horizontal velocity for wp navigation
2013-05-07 05:11:24 -03:00
void set_horizontal_velocity ( float velocity_cms ) { _wp_speed_cms = velocity_cms ; } ;
2013-04-18 02:51:01 -03:00
2013-06-01 05:19:05 -03:00
/// get_horizontal_velocity - allows main code to retrieve target horizontal velocity for wp navigation
float get_horizontal_velocity ( ) { return _wp_speed_cms ; } ;
2013-04-18 02:51:01 -03:00
/// get_climb_velocity - returns target climb speed in cm/s during missions
2013-05-07 05:11:24 -03:00
float get_climb_velocity ( ) const { return _wp_speed_up_cms ; } ;
2013-04-14 01:24:14 -03:00
2013-04-18 02:51:01 -03:00
/// get_descent_velocity - returns target descent speed in cm/s during missions. Note: always positive
2013-05-07 05:11:24 -03:00
float get_descent_velocity ( ) const { return _wp_speed_down_cms ; } ;
2013-04-02 06:23:46 -03:00
2013-04-14 01:24:14 -03:00
/// get_waypoint_radius - access for waypoint radius in cm
2013-04-21 07:54:31 -03:00
float get_waypoint_radius ( ) const { return _wp_radius_cm ; }
2013-04-14 01:24:14 -03:00
2013-07-10 07:44:24 -03:00
/// get_waypoint_acceleration - returns acceleration in cm/s/s during missions
float get_waypoint_acceleration ( ) const { return _wp_accel_cms . get ( ) ; }
2013-08-11 00:51:08 -03:00
/// set_lean_angle_max - limits maximum lean angle
void set_lean_angle_max ( int16_t angle_cd ) { if ( angle_cd > = 1000 & & angle_cd < = 8000 ) { _lean_angle_max_cd = angle_cd ; } }
2013-03-20 03:27:26 -03:00
static const struct AP_Param : : GroupInfo var_info [ ] ;
protected :
2013-05-08 12:18:02 -03:00
// flags structure
struct wpnav_flags {
uint8_t reached_destination : 1 ; // true if we have reached the destination
uint8_t fast_waypoint : 1 ; // true if we should ignore the waypoint radius and consider the waypoint complete once the intermediate target has reached the waypoint
} _flags ;
2013-03-20 03:27:26 -03:00
2013-04-01 09:53:40 -03:00
/// translate_loiter_target_movements - consumes adjustments created by move_loiter_target
void translate_loiter_target_movements ( float nav_dt ) ;
2013-04-15 09:54:29 -03:00
/// get_loiter_position_to_velocity - loiter position controller
/// converts desired position held in _target vector to desired velocity
2013-05-07 05:11:24 -03:00
void get_loiter_position_to_velocity ( float dt , float max_speed_cms ) ;
2013-03-20 03:27:26 -03:00
2013-04-15 09:54:29 -03:00
/// get_loiter_velocity_to_acceleration - loiter velocity controller
/// converts desired velocities in lat/lon directions to accelerations in lat/lon frame
void get_loiter_velocity_to_acceleration ( float vel_lat_cms , float vel_lon_cms , float dt ) ;
2013-03-20 03:27:26 -03:00
2013-04-15 09:54:29 -03:00
/// get_loiter_acceleration_to_lean_angles - loiter acceleration controller
2013-03-20 03:27:26 -03:00
/// converts desired accelerations provided in lat/lon frame to roll/pitch angles
2013-04-15 09:54:29 -03:00
void get_loiter_acceleration_to_lean_angles ( float accel_lat_cmss , float accel_lon_cmss ) ;
2013-03-20 03:27:26 -03:00
2013-03-20 10:28:05 -03:00
/// get_bearing_cd - return bearing in centi-degrees between two positions
2013-04-21 07:54:31 -03:00
float get_bearing_cd ( const Vector3f & origin , const Vector3f & destination ) const ;
2013-03-20 10:28:05 -03:00
/// reset_I - clears I terms from loiter PID controller
void reset_I ( ) ;
2013-03-20 03:27:26 -03:00
2013-05-07 05:11:24 -03:00
/// calculate_loiter_leash_length - calculates the maximum distance in cm that the target position may be from the current location
void calculate_loiter_leash_length ( ) ;
/// calculate_wp_leash_length - calculates horizontal and vertical leash lengths for waypoint controller
2013-04-18 02:51:01 -03:00
/// set climb param to true if track climbs vertically, false if descending
2013-05-07 05:11:24 -03:00
void calculate_wp_leash_length ( bool climb ) ;
2013-04-18 02:51:01 -03:00
2013-05-09 06:32:02 -03:00
// pointers to inertial nav and ahrs libraries
2013-03-20 03:27:26 -03:00
AP_InertialNav * _inav ;
2013-05-09 06:32:02 -03:00
AP_AHRS * _ahrs ;
2013-03-20 03:27:26 -03:00
// pointers to pid controllers
APM_PI * _pid_pos_lat ;
APM_PI * _pid_pos_lon ;
AC_PID * _pid_rate_lat ;
AC_PID * _pid_rate_lon ;
// parameters
2013-05-07 05:11:24 -03:00
AP_Float _loiter_speed_cms ; // maximum horizontal speed in cm/s while in loiter
AP_Float _wp_speed_cms ; // maximum horizontal speed in cm/s during missions
AP_Float _wp_speed_up_cms ; // climb speed target in cm/s
AP_Float _wp_speed_down_cms ; // descent speed target in cm/s
2013-04-18 02:51:01 -03:00
AP_Float _wp_radius_cm ; // distance from a waypoint in cm that, when crossed, indicates the wp has been reached
2013-06-15 23:39:54 -03:00
AP_Float _wp_accel_cms ; // acceleration in cm/s/s during missions
2013-08-27 23:33:10 -03:00
uint8_t _loiter_step ; // used to decide which portion of loiter controller to run during this iteration
uint8_t _wpnav_step ; // used to decide which portion of wpnav controller to run during this iteration
2013-04-14 06:27:39 -03:00
uint32_t _loiter_last_update ; // time of last update_loiter call
uint32_t _wpnav_last_update ; // time of last update_wpnav call
2013-08-27 23:33:10 -03:00
float _loiter_dt ; // time difference since last loiter call
float _wpnav_dt ; // time difference since last loiter call
2013-04-18 02:51:01 -03:00
float _cos_yaw ; // short-cut to save on calcs required to convert roll-pitch frame to lat-lon frame
2013-03-20 03:27:26 -03:00
float _sin_yaw ;
2013-04-21 04:27:50 -03:00
float _cos_pitch ;
2013-05-31 09:03:27 -03:00
float _althold_kP ; // alt hold's P gain
2013-03-20 03:27:26 -03:00
// output from controller
2013-03-20 10:28:05 -03:00
int32_t _desired_roll ; // fed to stabilize controllers at 50hz
int32_t _desired_pitch ; // fed to stabilize controllers at 50hz
2013-03-20 03:27:26 -03:00
2013-04-17 23:17:41 -03:00
// loiter controller internal variables
2013-03-20 03:27:26 -03:00
Vector3f _target ; // loiter's target location in cm from home
2013-04-17 23:17:41 -03:00
int16_t _pilot_vel_forward_cms ; // pilot's desired velocity forward (body-frame)
int16_t _pilot_vel_right_cms ; // pilot's desired velocity right (body-frame)
Vector3f _target_vel ; // pilot's latest desired velocity in earth-frame
2013-04-02 06:23:46 -03:00
Vector3f _vel_last ; // previous iterations velocity in cm/s
2013-05-07 05:11:24 -03:00
float _loiter_leash ; // loiter's horizontal leash length in cm. used to stop the pilot from pushing the target location too far from the current location
2013-06-15 23:39:54 -03:00
float _loiter_accel_cms ; // loiter's acceleration in cm/s/s
2013-08-11 00:51:08 -03:00
int16_t _lean_angle_max_cd ; // maximum lean angle in centi-degrees
2013-04-17 23:17:41 -03:00
// waypoint controller internal variables
2013-03-20 03:27:26 -03:00
Vector3f _origin ; // starting point of trip to next waypoint in cm from home (equivalent to next_WP)
Vector3f _destination ; // target destination in cm from home (equivalent to next_WP)
2013-04-06 10:25:58 -03:00
Vector3f _pos_delta_unit ; // each axis's percentage of the total track from origin to destination
2013-03-20 03:27:26 -03:00
float _track_length ; // distance in cm between origin and destination
float _track_desired ; // our desired distance along the track in cm
2013-03-20 10:28:05 -03:00
float _distance_to_target ; // distance to loiter target
2013-05-07 05:11:24 -03:00
float _wp_leash_xy ; // horizontal leash length in cm
2013-05-31 09:03:27 -03:00
float _wp_leash_z ; // horizontal leash length in cm
2013-04-29 22:20:23 -03:00
float _limited_speed_xy_cms ; // horizontal speed in cm/s used to advance the intermediate target towards the destination. used to limit extreme acceleration after passing a waypoint
2013-05-31 09:03:27 -03:00
float _track_accel ; // acceleration along track
float _track_speed ; // speed in cm/s along track
float _track_leash_length ; // leash length along track
2013-03-20 10:28:05 -03:00
2013-04-15 09:54:29 -03:00
public :
// for logging purposes
Vector2f dist_error ; // distance error calculated by loiter controller
Vector2f desired_vel ; // loiter controller desired velocity
Vector2f desired_accel ; // the resulting desired acceleration
2013-05-24 11:45:03 -03:00
2013-03-20 10:28:05 -03:00
// To-Do: add split of fast (100hz for accel->angle) and slow (10hz for navigation)
/// update - run the loiter and wpnav controllers - should be called at 100hz
//void update_100hz(void);
/// update - run the loiter and wpnav controllers - should be called at 10hz
//void update_10hz(void);
2013-03-20 03:27:26 -03:00
} ;
# endif // AC_WPNAV_H