A class implementing a local planner using the Dynamic Window Approach. More...
#include <dwa_planner.h>
Public Member Functions | |
bool | checkTrajectory (const Eigen::Vector3f &pos, const Eigen::Vector3f &vel) |
Check if a trajectory is legal for a position/velocity pari. | |
Eigen::Vector3f | computeNewPositions (const Eigen::Vector3f &pos, const Eigen::Vector3f &vel, double dt) |
Given a current position, velocity, and timestep... compute a new position. | |
base_local_planner::Trajectory | computeTrajectories (const Eigen::Vector3f &pos, const Eigen::Vector3f &vel) |
Given the current position and velocity of the robot, computes and scores a number of possible trajectories to execute, returning the best option. | |
DWAPlanner (std::string name, costmap_2d::Costmap2DROS *costmap_ros) | |
Constructor for the planner. | |
base_local_planner::Trajectory | findBestPath (tf::Stamped< tf::Pose > global_pose, tf::Stamped< tf::Pose > global_vel, tf::Stamped< tf::Pose > &drive_velocities) |
Given the current position and velocity of the robot, find the best trajectory to exectue. | |
void | generateTrajectory (Eigen::Vector3f pos, const Eigen::Vector3f &vel, base_local_planner::Trajectory &traj, bool two_point_scoring) |
Given the current position of the robot and a desired velocity, generate and score a trajectory for the given velocity. | |
Eigen::Vector3f | getAccLimits () |
Get the acceleration limits of the robot. | |
bool | getCellCosts (int cx, int cy, float &path_cost, float &goal_cost, float &occ_cost, float &total_cost) |
Compute the components and total cost for a map grid cell. | |
double | getSimPeriod () |
Get the period at which the local planner is expected to run. | |
void | updatePlan (const std::vector< geometry_msgs::PoseStamped > &new_plan) |
Take in a new global plan for the local planner to follow. | |
~DWAPlanner () | |
Destructor for the planner. | |
Private Member Functions | |
double | footprintCost (const Eigen::Vector3f &pos, double scale) |
Given a position for the robot and a scale for the footprint, compute a cost. | |
Eigen::Vector3f | getMaxSpeedToStopInTime (double time) |
Given a time and the robot's acceleration limits, get the maximum velocity for the robot to be able to stop in the alloted time period. | |
bool | oscillationCheck (const Eigen::Vector3f &vel) |
For a given velocity, check it it is illegal because of the oscillation flags set. | |
void | reconfigureCB (DWAPlannerConfig &config, uint32_t level) |
Callback to update the local planner's parameters based on dynamic reconfigure. | |
void | resetOscillationFlags () |
Reset the oscillation flags for the local planner. | |
void | resetOscillationFlagsIfPossible (const Eigen::Vector3f &pos, const Eigen::Vector3f &prev) |
Given the robot's current position and the position where oscillation flags were last set, check to see if the robot had moved far enough to reset them. | |
void | selectBestTrajectory (base_local_planner::Trajectory *&best, base_local_planner::Trajectory *&comp) |
Given two trajectories to compare... select the best one. | |
bool | setOscillationFlags (base_local_planner::Trajectory *t) |
Given a trajectory that's selected, set flags if needed to prevent the robot from oscillating. | |
double | squareDist (const geometry_msgs::PoseStamped &p1, const geometry_msgs::PoseStamped &p2) |
Compute the square distance between two poses. | |
Private Attributes | |
Eigen::Vector3f | acc_lim_ |
boost::mutex | configuration_mutex_ |
costmap_2d::Costmap2D | costmap_ |
costmap_2d::Costmap2DROS * | costmap_ros_ |
dwa_local_planner::DWAPlannerConfig | default_config_ |
dynamic_reconfigure::Server < DWAPlannerConfig > | dsrv_ |
std::vector< geometry_msgs::Point > | footprint_spec_ |
bool | forward_neg_ |
bool | forward_neg_only_ |
double | forward_point_distance_ |
bool | forward_pos_ |
bool | forward_pos_only_ |
base_local_planner::MapGrid | front_map_ |
double | gdist_scale_ |
std::vector < geometry_msgs::PoseStamped > | global_plan_ |
double | heading_lookahead_ |
double | heading_scale_ |
base_local_planner::MapGrid | map_ |
base_local_planner::MapGridVisualizer | map_viz_ |
The map grid visualizer for outputting the potential field generated by the cost function. | |
double | max_scaling_factor_ |
double | max_vel_th_ |
double | max_vel_trans_ |
double | max_vel_x_ |
double | max_vel_y_ |
double | min_rot_vel_ |
double | min_vel_th_ |
double | min_vel_trans_ |
double | min_vel_x_ |
double | min_vel_y_ |
double | occdist_scale_ |
double | oscillation_reset_dist_ |
double | pdist_scale_ |
bool | penalize_negative_x_ |
Eigen::Vector3f | prev_stationary_pos_ |
bool | rot_neg_only_ |
bool | rot_pos_only_ |
bool | rotating_neg_ |
bool | rotating_pos_ |
double | scaling_speed_ |
bool | setup_ |
double | sim_granularity_ |
double | sim_period_ |
double | sim_time_ |
double | stop_time_buffer_ |
bool | strafe_neg_only_ |
bool | strafe_pos_only_ |
bool | strafing_neg_ |
bool | strafing_pos_ |
base_local_planner::Trajectory | traj_one_ |
base_local_planner::Trajectory | traj_two_ |
Eigen::Vector3f | vsamples_ |
base_local_planner::CostmapModel * | world_model_ |
A class implementing a local planner using the Dynamic Window Approach.
Definition at line 63 of file dwa_planner.h.
dwa_local_planner::DWAPlanner::DWAPlanner | ( | std::string | name, |
costmap_2d::Costmap2DROS * | costmap_ros | ||
) |
Constructor for the planner.
name | The name of the planner |
costmap_ros | A pointer to the costmap instance the planner should use |
Definition at line 111 of file dwa_planner.cpp.
dwa_local_planner::DWAPlanner::~DWAPlanner | ( | ) | [inline] |
Destructor for the planner.
Definition at line 75 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::checkTrajectory | ( | const Eigen::Vector3f & | pos, |
const Eigen::Vector3f & | vel | ||
) |
Check if a trajectory is legal for a position/velocity pari.
pos | The robot's position |
vel | The desired velocity |
Definition at line 566 of file dwa_planner.cpp.
Eigen::Vector3f dwa_local_planner::DWAPlanner::computeNewPositions | ( | const Eigen::Vector3f & | pos, |
const Eigen::Vector3f & | vel, | ||
double | dt | ||
) |
Given a current position, velocity, and timestep... compute a new position.
pos | The current position |
vel | The current velocity |
dt | The timestep |
Definition at line 180 of file dwa_planner.cpp.
base_local_planner::Trajectory dwa_local_planner::DWAPlanner::computeTrajectories | ( | const Eigen::Vector3f & | pos, |
const Eigen::Vector3f & | vel | ||
) |
Given the current position and velocity of the robot, computes and scores a number of possible trajectories to execute, returning the best option.
pos | The current position of the robot |
vel | The current velocity of the robot |
Definition at line 234 of file dwa_planner.cpp.
base_local_planner::Trajectory dwa_local_planner::DWAPlanner::findBestPath | ( | tf::Stamped< tf::Pose > | global_pose, |
tf::Stamped< tf::Pose > | global_vel, | ||
tf::Stamped< tf::Pose > & | drive_velocities | ||
) |
Given the current position and velocity of the robot, find the best trajectory to exectue.
global_pose | The current position of the robot |
global_vel | The current velocity of the robot |
drive_velocities | The velocities to send to the robot base |
Definition at line 587 of file dwa_planner.cpp.
double dwa_local_planner::DWAPlanner::footprintCost | ( | const Eigen::Vector3f & | pos, |
double | scale | ||
) | [private] |
Given a position for the robot and a scale for the footprint, compute a cost.
pos | The pose of the robot |
scale | The scaling factor for the footprint |
Definition at line 407 of file dwa_planner.cpp.
void dwa_local_planner::DWAPlanner::generateTrajectory | ( | Eigen::Vector3f | pos, |
const Eigen::Vector3f & | vel, | ||
base_local_planner::Trajectory & | traj, | ||
bool | two_point_scoring | ||
) |
Given the current position of the robot and a desired velocity, generate and score a trajectory for the given velocity.
pos | The current position of the robot |
vel | The desired velocity for the trajectory |
traj | A reference to the Trajectory to be populated. A cost >= 0 for the trajectory means that it is valid. |
two_point_scoring | Whether to score the trajectory based on the center point of the robot and a point directly in front of the center point, or to score the trajectory only basaed on the center point of the robot |
Definition at line 429 of file dwa_planner.cpp.
Eigen::Vector3f dwa_local_planner::DWAPlanner::getAccLimits | ( | ) | [inline] |
Get the acceleration limits of the robot.
Definition at line 136 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::getCellCosts | ( | int | cx, |
int | cy, | ||
float & | path_cost, | ||
float & | goal_cost, | ||
float & | occ_cost, | ||
float & | total_cost | ||
) |
Compute the components and total cost for a map grid cell.
cx | The x coordinate of the cell in the map grid |
cy | The y coordinate of the cell in the map grid |
path_cost | Will be set to the path distance component of the cost function |
goal_cost | Will be set to the goal distance component of the cost function |
occ_cost | Will be set to the costmap value of the cell |
total_cost | Will be set to the value of the overall cost function, taking into account the scaling parameters |
Definition at line 163 of file dwa_planner.cpp.
Eigen::Vector3f dwa_local_planner::DWAPlanner::getMaxSpeedToStopInTime | ( | double | time | ) | [inline, private] |
Given a time and the robot's acceleration limits, get the maximum velocity for the robot to be able to stop in the alloted time period.
Definition at line 213 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::getSimPeriod | ( | ) | [inline] |
Get the period at which the local planner is expected to run.
Definition at line 142 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::oscillationCheck | ( | const Eigen::Vector3f & | vel | ) | [private] |
For a given velocity, check it it is illegal because of the oscillation flags set.
Definition at line 212 of file dwa_planner.cpp.
void dwa_local_planner::DWAPlanner::reconfigureCB | ( | DWAPlannerConfig & | config, |
uint32_t | level | ||
) | [private] |
Callback to update the local planner's parameters based on dynamic reconfigure.
Definition at line 41 of file dwa_planner.cpp.
void dwa_local_planner::DWAPlanner::resetOscillationFlags | ( | ) | [private] |
Reset the oscillation flags for the local planner.
Definition at line 325 of file dwa_planner.cpp.
void dwa_local_planner::DWAPlanner::resetOscillationFlagsIfPossible | ( | const Eigen::Vector3f & | pos, |
const Eigen::Vector3f & | prev | ||
) | [private] |
Given the robot's current position and the position where oscillation flags were last set, check to see if the robot had moved far enough to reset them.
pos | The current position of the robot |
prev | The position at which the oscillation flags were last set |
Definition at line 314 of file dwa_planner.cpp.
void dwa_local_planner::DWAPlanner::selectBestTrajectory | ( | base_local_planner::Trajectory *& | best, |
base_local_planner::Trajectory *& | comp | ||
) | [private] |
Given two trajectories to compare... select the best one.
best | The current best trajectory, will be set to the new best trajectory if comp scores higher |
comp | The trajectory to compare to the current best trajectory |
Definition at line 189 of file dwa_planner.cpp.
bool dwa_local_planner::DWAPlanner::setOscillationFlags | ( | base_local_planner::Trajectory * | t | ) | [private] |
Given a trajectory that's selected, set flags if needed to prevent the robot from oscillating.
t | The selected trajectory |
Definition at line 342 of file dwa_planner.cpp.
double dwa_local_planner::DWAPlanner::squareDist | ( | const geometry_msgs::PoseStamped & | p1, |
const geometry_msgs::PoseStamped & | p2 | ||
) | [inline, private] |
Compute the square distance between two poses.
Definition at line 203 of file dwa_planner.h.
void dwa_local_planner::DWAPlanner::updatePlan | ( | const std::vector< geometry_msgs::PoseStamped > & | new_plan | ) |
Take in a new global plan for the local planner to follow.
new_plan | The new global plan |
Definition at line 579 of file dwa_planner.cpp.
Eigen::Vector3f dwa_local_planner::DWAPlanner::acc_lim_ [private] |
Definition at line 227 of file dwa_planner.h.
boost::mutex dwa_local_planner::DWAPlanner::configuration_mutex_ [private] |
Definition at line 247 of file dwa_planner.h.
Definition at line 224 of file dwa_planner.h.
Definition at line 223 of file dwa_planner.h.
dwa_local_planner::DWAPlannerConfig dwa_local_planner::DWAPlanner::default_config_ [private] |
Definition at line 245 of file dwa_planner.h.
dynamic_reconfigure::Server<DWAPlannerConfig> dwa_local_planner::DWAPlanner::dsrv_ [private] |
Definition at line 244 of file dwa_planner.h.
std::vector<geometry_msgs::Point> dwa_local_planner::DWAPlanner::footprint_spec_ [private] |
Definition at line 228 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::forward_neg_ [private] |
Definition at line 238 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::forward_neg_only_ [private] |
Definition at line 238 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::forward_point_distance_ [private] |
Definition at line 240 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::forward_pos_ [private] |
Definition at line 238 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::forward_pos_only_ [private] |
Definition at line 238 of file dwa_planner.h.
Definition at line 222 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::gdist_scale_ [private] |
Definition at line 226 of file dwa_planner.h.
std::vector<geometry_msgs::PoseStamped> dwa_local_planner::DWAPlanner::global_plan_ [private] |
Definition at line 242 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::heading_lookahead_ [private] |
Definition at line 240 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::heading_scale_ [private] |
Definition at line 226 of file dwa_planner.h.
Definition at line 222 of file dwa_planner.h.
The map grid visualizer for outputting the potential field generated by the cost function.
Definition at line 249 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::max_scaling_factor_ [private] |
Definition at line 241 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::max_vel_th_ [private] |
Definition at line 233 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::max_vel_trans_ [private] |
Definition at line 232 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::max_vel_x_ [private] |
Definition at line 231 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::max_vel_y_ [private] |
Definition at line 232 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::min_rot_vel_ [private] |
Definition at line 233 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::min_vel_th_ [private] |
Definition at line 233 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::min_vel_trans_ [private] |
Definition at line 232 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::min_vel_x_ [private] |
Definition at line 231 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::min_vel_y_ [private] |
Definition at line 232 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::occdist_scale_ [private] |
Definition at line 226 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::oscillation_reset_dist_ [private] |
Definition at line 239 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::pdist_scale_ [private] |
Definition at line 226 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::penalize_negative_x_ [private] |
Definition at line 248 of file dwa_planner.h.
Eigen::Vector3f dwa_local_planner::DWAPlanner::prev_stationary_pos_ [private] |
Definition at line 227 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::rot_neg_only_ [private] |
Definition at line 237 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::rot_pos_only_ [private] |
Definition at line 237 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::rotating_neg_ [private] |
Definition at line 237 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::rotating_pos_ [private] |
Definition at line 237 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::scaling_speed_ [private] |
Definition at line 241 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::setup_ [private] |
Definition at line 246 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::sim_granularity_ [private] |
Definition at line 230 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::sim_period_ [private] |
Definition at line 234 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::sim_time_ [private] |
Definition at line 230 of file dwa_planner.h.
double dwa_local_planner::DWAPlanner::stop_time_buffer_ [private] |
Definition at line 225 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::strafe_neg_only_ [private] |
Definition at line 236 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::strafe_pos_only_ [private] |
Definition at line 236 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::strafing_neg_ [private] |
Definition at line 236 of file dwa_planner.h.
bool dwa_local_planner::DWAPlanner::strafing_pos_ [private] |
Definition at line 236 of file dwa_planner.h.
Definition at line 235 of file dwa_planner.h.
Definition at line 235 of file dwa_planner.h.
Eigen::Vector3f dwa_local_planner::DWAPlanner::vsamples_ [private] |
Definition at line 227 of file dwa_planner.h.
Definition at line 229 of file dwa_planner.h.