Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.
Real-time collaboration for Jupyter Notebooks, Linux Terminals, LaTeX, VS Code, R IDE, and more,
all in one place. Commercial Alternative to JupyterHub.
Path: blob/master/libraries/AC_WPNav/AC_Circle.h
Views: 1798
#pragma once12#include <AP_Common/AP_Common.h>3#include <AP_Param/AP_Param.h>4#include <AP_Math/AP_Math.h>5#include <AP_InertialNav/AP_InertialNav.h> // Inertial Navigation library6#include <AC_AttitudeControl/AC_PosControl.h> // Position control library78// loiter maximum velocities and accelerations9#define AC_CIRCLE_RADIUS_DEFAULT 1000.0f // radius of the circle in cm that the vehicle will fly10#define AC_CIRCLE_RATE_DEFAULT 20.0f // turn rate in deg/sec. Positive to turn clockwise, negative for counter clockwise11#define AC_CIRCLE_ANGULAR_ACCEL_MIN 2.0f // angular acceleration should never be less than 2deg/sec12#define AC_CIRCLE_RADIUS_MAX 200000.0f // maximum allowed circle radius of 2km1314class AC_Circle15{16public:1718/// Constructor19AC_Circle(const AP_InertialNav& inav, const AP_AHRS_View& ahrs, AC_PosControl& pos_control);2021/// init - initialise circle controller setting center specifically22/// set terrain_alt to true if center.z should be interpreted as an alt-above-terrain. Rate should be +ve in deg/sec for cw turn23/// caller should set the position controller's x,y and z speeds and accelerations before calling this24void init(const Vector3p& center, bool terrain_alt, float rate_deg_per_sec);2526/// init - initialise circle controller setting center using stopping point and projecting out based on the copter's heading27/// caller should set the position controller's x,y and z speeds and accelerations before calling this28void init();2930/// set circle center to a Location31void set_center(const Location& center);3233/// set_circle_center as a vector from ekf origin34/// terrain_alt should be true if center.z is alt is above terrain35void set_center(const Vector3f& center, bool terrain_alt) { _center = center.topostype(); _terrain_alt = terrain_alt; }3637/// get_circle_center in cm from home38const Vector3p& get_center() const { return _center; }3940/// returns true if using terrain altitudes41bool center_is_terrain_alt() const { return _terrain_alt; }4243/// get_radius - returns radius of circle in cm44float get_radius() const { return is_positive(_radius)?_radius:_radius_parm; }4546/// set_radius_cm - sets circle radius in cm47void set_radius_cm(float radius_cm);4849/// get_rate - returns target rate in deg/sec held in RATE parameter50float get_rate() const { return _rate; }5152/// get_rate_current - returns actual calculated rate target in deg/sec, which may be less than _rate53float get_rate_current() const { return ToDeg(_angular_vel); }5455/// set_rate - set circle rate in degrees per second56void set_rate(float deg_per_sec);5758/// get_angle_total - return total angle in radians that vehicle has circled59float get_angle_total() const { return _angle_total; }6061/// update - update circle controller62/// returns false on failure which indicates a terrain failsafe63bool update(float climb_rate_cms = 0.0f) WARN_IF_UNUSED;6465/// get desired roll, pitch which should be fed into stabilize controllers66float get_roll() const { return _pos_control.get_roll_cd(); }67float get_pitch() const { return _pos_control.get_pitch_cd(); }68Vector3f get_thrust_vector() const { return _pos_control.get_thrust_vector(); }69float get_yaw() const { return _yaw; }7071/// returns true if update has been run recently72/// used by vehicle code to determine if get_yaw() is valid73bool is_active() const;7475// get_closest_point_on_circle - returns closest point on the circle76// circle's center should already have been set77// closest point on the circle will be placed in result, dist_cm will be updated with the distance to the center78// result's altitude (i.e. z) will be set to the circle_center's altitude79// if vehicle is at the center of the circle, the edge directly behind vehicle will be returned80void get_closest_point_on_circle(Vector3f& result, float& dist_cm) const;8182/// get horizontal distance to loiter target in cm83float get_distance_to_target() const { return _pos_control.get_pos_error_xy_cm(); }8485/// get bearing to target in centi-degrees86int32_t get_bearing_to_target() const { return _pos_control.get_bearing_to_target_cd(); }8788/// true if pilot control of radius and turn rate is enabled89bool pilot_control_enabled() const { return (_options.get() & CircleOptions::MANUAL_CONTROL) != 0; }9091/// true if mount roi is at circle center92bool roi_at_center() const { return (_options.get() & CircleOptions::ROI_AT_CENTER) != 0; }9394/// provide rangefinder based terrain offset95/// terrain offset is the terrain's height above the EKF origin96void set_rangefinder_terrain_offset(bool use, bool healthy, float terrain_offset_cm) { _rangefinder_available = use; _rangefinder_healthy = healthy; _rangefinder_terrain_offset_cm = terrain_offset_cm;}9798/// check for a change in the radius params99void check_param_change();100101static const struct AP_Param::GroupInfo var_info[];102103private:104105// calc_velocities - calculate angular velocity max and acceleration based on radius and rate106// this should be called whenever the radius or rate are changed107// initialises the yaw and current position around the circle108// init_velocity should be set true if vehicle is just starting circle109void calc_velocities(bool init_velocity);110111// init_start_angle - sets the starting angle around the circle and initialises the angle_total112// if use_heading is true the vehicle's heading will be used to init the angle causing minimum yaw movement113// if use_heading is false the vehicle's position from the center will be used to initialise the angle114void init_start_angle(bool use_heading);115116// get expected source of terrain data117enum class TerrainSource {118TERRAIN_UNAVAILABLE,119TERRAIN_FROM_RANGEFINDER,120TERRAIN_FROM_TERRAINDATABASE,121};122AC_Circle::TerrainSource get_terrain_source() const;123124// get terrain's altitude (in cm above the ekf origin) at the current position (+ve means terrain below vehicle is above ekf origin's altitude)125bool get_terrain_offset(float& offset_cm);126127// flags structure128struct circle_flags {129uint8_t panorama : 1; // true if we are doing a panorama130} _flags;131132// references to inertial nav and ahrs libraries133const AP_InertialNav& _inav;134const AP_AHRS_View& _ahrs;135AC_PosControl& _pos_control;136137enum CircleOptions {138MANUAL_CONTROL = 1U << 0,139FACE_DIRECTION_OF_TRAVEL = 1U << 1,140INIT_AT_CENTER = 1U << 2, // true then the circle center will be the current location, false and the center will be 1 radius ahead141ROI_AT_CENTER = 1U << 3, // true when the mount roi is at circle center142};143144// parameters145AP_Float _radius_parm; // radius of circle in cm loaded from params146AP_Float _rate_parm; // rotation speed in deg/sec147AP_Int16 _options; // stick control enable/disable148149// internal variables150Vector3p _center; // center of circle in cm from home151float _radius; // radius of circle in cm152float _rate; // rotation speed of circle in deg/sec. +ve for cw turn153float _yaw; // yaw heading (normally towards circle center)154float _angle; // current angular position around circle in radians (0=directly north of the center of the circle)155float _angle_total; // total angle travelled in radians156float _angular_vel; // angular velocity in radians/sec157float _angular_vel_max; // maximum velocity in radians/sec158float _angular_accel; // angular acceleration in radians/sec/sec159uint32_t _last_update_ms; // system time of last update160float _last_radius_param; // last value of radius param, used to update radius on param change161162// terrain following variables163bool _terrain_alt; // true if _center.z is alt-above-terrain, false if alt-above-ekf-origin164bool _rangefinder_available; // true if range finder could be used165bool _rangefinder_healthy; // true if range finder is healthy166float _rangefinder_terrain_offset_cm; // latest rangefinder based terrain offset (e.g. terrain's height above EKF origin)167};168169170