Skip to content

Commit

Permalink
Plane: add guided path navigation
Browse files Browse the repository at this point in the history
- Add guided path sub-mode

- Extend handling of SET_POSITION_TARGET_GLOBAL_INT to include path guidance
- Check for non-zero velocity and acceleration
- Calculate path curvature and direction
- Force update of adjust_altitude_target.
- Remove duplicate check for guided mode.

Signed-off-by: Rhys Mainwaring <[email protected]>
  • Loading branch information
srmainwaring committed Mar 12, 2024
1 parent 0199a63 commit 916dac4
Show file tree
Hide file tree
Showing 3 changed files with 116 additions and 4 deletions.
65 changes: 62 additions & 3 deletions ArduPlane/GCS_Mavlink.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -1373,10 +1373,13 @@ void GCS_MAVLINK_Plane::handle_set_position_target_global_int(const mavlink_mess
// be IGNORNED rather than INCLUDED. See mavlink documentation of the
// SET_POSITION_TARGET_GLOBAL_INT message, type_mask field.
const uint16_t alt_mask = 0b1111111111111011; // (z mask at bit 3)


// bit mask for path following: ignore force_set, yaw, yaw_rate
const uint16_t path_mask = 0b1111111000000000;

bool msg_valid = true;
AP_Mission::Mission_Command cmd = {0};

if (pos_target.type_mask & alt_mask)
{
cmd.content.location.alt = pos_target.alt * 100;
Expand Down Expand Up @@ -1405,7 +1408,63 @@ void GCS_MAVLINK_Plane::handle_set_position_target_global_int(const mavlink_mess
if (msg_valid) {
handle_change_alt_request(cmd);
}
} // end if alt_mask
} // end if alt_mask

// guided path following
if (pos_target.type_mask & path_mask) {
cmd.content.location.lat = pos_target.lat_int;
cmd.content.location.lng = pos_target.lon_int;

cmd.content.location.alt = pos_target.alt * 100;
cmd.content.location.relative_alt = false;
cmd.content.location.terrain_alt = false;
switch (pos_target.coordinate_frame)
{
case MAV_FRAME_GLOBAL_RELATIVE_ALT_INT:
cmd.content.location.relative_alt = true;
break;
default:
gcs().send_text(MAV_SEVERITY_WARNING, "Invalid coord frame in SET_POSTION_TARGET_GLOBAL_INT");
msg_valid = false;
break;
}

if (msg_valid) {
Vector2f vel(pos_target.vx, pos_target.vy);
Vector2f accel(pos_target.afx, pos_target.afy);
Vector2f unit_vel;

float path_curvature{0.0};
bool dir_is_ccw{false};

if (!vel.is_zero()) {
unit_vel = vel.normalized();

if (!accel.is_zero()) {
// curvature is determined from the acceleration normal
// to the planar velocity and the equation for uniform
// circular motion: a = v^2 / r.
float accel_proj = accel.dot(unit_vel);
Vector2f accel_lat = accel - unit_vel * accel_proj;
Vector2f accel_lat_unit = accel_lat.normalized();

path_curvature = accel_lat.length() / vel.length_squared();

// % is cross product, direction: cw:= 1, ccw:= -1
float dir = accel_lat_unit % unit_vel;
dir_is_ccw = dir < 0.0;
}
}

// update path guidance
plane.mode_guided.handle_guided_path_request(
cmd.content.location, unit_vel, path_curvature, dir_is_ccw);

// update adjust_altitude_target immediately rather than wait
// for the scheduler.
plane.adjust_altitude_target();
}
}
}

MAV_RESULT GCS_MAVLINK_Plane::handle_command_do_set_mission_current(const mavlink_command_int_t &packet)
Expand Down
15 changes: 15 additions & 0 deletions ArduPlane/mode.h
Original file line number Diff line number Diff line change
Expand Up @@ -296,17 +296,32 @@ class ModeGuided : public Mode
// handle a guided target request from GCS
bool handle_guided_request(Location target_loc) override;

// handle a guided path following request
bool handle_guided_path_request(Location position_on_path, Vector2f unit_path_tangent, const float path_curvature, const bool direction_is_ccw);

void set_radius_and_direction(const float radius, const bool direction_is_ccw);

void update_target_altitude() override;

protected:

enum class SubMode: uint8_t {
WP,
Path
};

bool _enter() override;
bool _pre_arm_checks(size_t buflen, char *buffer) const override { return true; }

private:

SubMode _guided_mode;

float active_radius_m;

// used in path mode
float _path_curvature;
Vector2f _unit_path_tangent;
};

class ModeCircle: public Mode
Expand Down
40 changes: 39 additions & 1 deletion ArduPlane/mode_guided.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -103,7 +103,18 @@ void ModeGuided::update()

void ModeGuided::navigate()
{
plane.update_loiter(active_radius_m);
switch (_guided_mode) {
case SubMode::WP:
plane.update_loiter(active_radius_m);
break;
case SubMode::Path:
plane.nav_controller->update_path(plane.next_WP_loc,
_unit_path_tangent, _path_curvature, plane.loiter.direction);
break;
default:
gcs().send_text(MAV_SEVERITY_WARNING, "Unknown GUIDED mode");
break;
}
}

bool ModeGuided::handle_guided_request(Location target_loc)
Expand All @@ -116,6 +127,33 @@ bool ModeGuided::handle_guided_request(Location target_loc)

plane.set_guided_WP(target_loc);

// use waypoint navigation sub-mode
_guided_mode = SubMode::WP;

return true;
}

bool ModeGuided::handle_guided_path_request(Location position_on_path, Vector2f unit_path_tangent, const float path_curvature, const bool direction_is_ccw)
{
// add home alt if needed
if (position_on_path.relative_alt) {
position_on_path.alt += plane.home.alt;
position_on_path.relative_alt = 0;
}

// copy the current location into the OldWP slot
plane.prev_WP_loc = plane.current_loc;

// load the next_WP slot
plane.next_WP_loc = position_on_path;

_unit_path_tangent = unit_path_tangent;
_path_curvature = path_curvature;
plane.loiter.direction = direction_is_ccw ? -1 : 1;

// use path navigation sub-mode
_guided_mode = SubMode::Path;

return true;
}

Expand Down

0 comments on commit 916dac4

Please sign in to comment.