A ROS wrapper for the trajectory controller that queries the param server to construct a controller.
More...
#include <trajectory_planner_ros.h>
|
bool | checkTrajectory (double vx_samp, double vy_samp, double vtheta_samp, bool update_map=true) |
| Generate and score a single trajectory. More...
|
|
bool | computeVelocityCommands (geometry_msgs::Twist &cmd_vel) |
| Given the current position, orientation, and velocity of the robot, compute velocity commands to send to the base. More...
|
|
TrajectoryPlanner * | getPlanner () const |
| Return the inner TrajectoryPlanner object. Only valid after initialize(). More...
|
|
void | initialize (std::string name, tf::TransformListener *tf, costmap_2d::Costmap2DROS *costmap_ros) |
| Constructs the ros wrapper. More...
|
|
bool | isGoalReached () |
| Check if the goal pose has been achieved. More...
|
|
bool | isInitialized () |
|
double | scoreTrajectory (double vx_samp, double vy_samp, double vtheta_samp, bool update_map=true) |
| Generate and score a single trajectory. More...
|
|
bool | setPlan (const std::vector< geometry_msgs::PoseStamped > &orig_global_plan) |
| Set the plan that the controller is following. More...
|
|
| TrajectoryPlannerROS () |
| Default constructor for the ros wrapper. More...
|
|
| TrajectoryPlannerROS (std::string name, tf::TransformListener *tf, costmap_2d::Costmap2DROS *costmap_ros) |
| Constructs the ros wrapper. More...
|
|
| ~TrajectoryPlannerROS () |
| Destructor for the wrapper. More...
|
|
virtual | ~BaseLocalPlanner () |
|
A ROS wrapper for the trajectory controller that queries the param server to construct a controller.
Definition at line 80 of file trajectory_planner_ros.h.
base_local_planner::TrajectoryPlannerROS::TrajectoryPlannerROS |
( |
| ) |
|
Constructs the ros wrapper.
- Parameters
-
name | The name to give this instance of the trajectory planner |
tf | A pointer to a transform listener |
costmap | The cost map to use for assigning costs to trajectories |
Definition at line 77 of file trajectory_planner_ros.cpp.
base_local_planner::TrajectoryPlannerROS::~TrajectoryPlannerROS |
( |
| ) |
|
bool base_local_planner::TrajectoryPlannerROS::checkTrajectory |
( |
double |
vx_samp, |
|
|
double |
vy_samp, |
|
|
double |
vtheta_samp, |
|
|
bool |
update_map = true |
|
) |
| |
Generate and score a single trajectory.
- Parameters
-
vx_samp | The x velocity used to seed the trajectory |
vy_samp | The y velocity used to seed the trajectory |
vtheta_samp | The theta velocity used to seed the trajectory |
update_map | Whether or not to update the map for the planner when computing the legality of the trajectory, this is useful to set to false if you're going to be doing a lot of trajectory checking over a short period of time |
- Returns
- True if the trajectory is legal, false otherwise
Definition at line 528 of file trajectory_planner_ros.cpp.
bool base_local_planner::TrajectoryPlannerROS::computeVelocityCommands |
( |
geometry_msgs::Twist & |
cmd_vel | ) |
|
|
virtual |
Given the current position, orientation, and velocity of the robot, compute velocity commands to send to the base.
- Parameters
-
cmd_vel | Will be filled with the velocity command to be passed to the robot base |
- Returns
- True if a valid trajectory was found, false otherwise
Implements nav_core::BaseLocalPlanner.
Definition at line 372 of file trajectory_planner_ros.cpp.
Constructs the ros wrapper.
- Parameters
-
name | The name to give this instance of the trajectory planner |
tf | A pointer to a transform listener |
costmap | The cost map to use for assigning costs to trajectories |
Implements nav_core::BaseLocalPlanner.
Definition at line 84 of file trajectory_planner_ros.cpp.
bool base_local_planner::TrajectoryPlannerROS::isGoalReached |
( |
| ) |
|
|
virtual |
bool base_local_planner::TrajectoryPlannerROS::isInitialized |
( |
| ) |
|
|
inline |
std::vector< double > base_local_planner::TrajectoryPlannerROS::loadYVels |
( |
ros::NodeHandle |
node | ) |
|
|
private |
void base_local_planner::TrajectoryPlannerROS::reconfigureCB |
( |
BaseLocalPlannerConfig & |
config, |
|
|
uint32_t |
level |
|
) |
| |
|
private |
bool base_local_planner::TrajectoryPlannerROS::rotateToGoal |
( |
const tf::Stamped< tf::Pose > & |
global_pose, |
|
|
const tf::Stamped< tf::Pose > & |
robot_vel, |
|
|
double |
goal_th, |
|
|
geometry_msgs::Twist & |
cmd_vel |
|
) |
| |
|
private |
Once a goal position is reached... rotate to the goal orientation.
- Parameters
-
global_pose | The pose of the robot in the global frame |
robot_vel | The velocity of the robot |
goal_th | The desired th value for the goal |
cmd_vel | The velocity commands to be filled |
- Returns
- True if a valid trajectory was found, false otherwise
Definition at line 312 of file trajectory_planner_ros.cpp.
double base_local_planner::TrajectoryPlannerROS::scoreTrajectory |
( |
double |
vx_samp, |
|
|
double |
vy_samp, |
|
|
double |
vtheta_samp, |
|
|
bool |
update_map = true |
|
) |
| |
Generate and score a single trajectory.
- Parameters
-
vx_samp | The x velocity used to seed the trajectory |
vy_samp | The y velocity used to seed the trajectory |
vtheta_samp | The theta velocity used to seed the trajectory |
update_map | Whether or not to update the map for the planner when computing the legality of the trajectory, this is useful to set to false if you're going to be doing a lot of trajectory checking over a short period of time |
- Returns
- score of trajectory (double)
Definition at line 559 of file trajectory_planner_ros.cpp.
bool base_local_planner::TrajectoryPlannerROS::setPlan |
( |
const std::vector< geometry_msgs::PoseStamped > & |
orig_global_plan | ) |
|
|
virtual |
double base_local_planner::TrajectoryPlannerROS::sign |
( |
double |
x | ) |
|
|
inlineprivate |
Stop the robot taking into account acceleration limits.
- Parameters
-
global_pose | The pose of the robot in the global frame |
robot_vel | The velocity of the robot |
cmd_vel | The velocity commands to be filled |
- Returns
- True if a valid trajectory was found, false otherwise
Definition at line 283 of file trajectory_planner_ros.cpp.
double base_local_planner::TrajectoryPlannerROS::acc_lim_theta_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::acc_lim_x_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::acc_lim_y_ |
|
private |
nav_msgs::Odometry base_local_planner::TrajectoryPlannerROS::base_odom_ |
|
private |
base_local_planner::BaseLocalPlannerConfig base_local_planner::TrajectoryPlannerROS::default_config_ |
|
private |
dynamic_reconfigure::Server<BaseLocalPlannerConfig>* base_local_planner::TrajectoryPlannerROS::dsrv_ |
|
private |
std::string base_local_planner::TrajectoryPlannerROS::global_frame_ |
|
private |
std::vector<geometry_msgs::PoseStamped> base_local_planner::TrajectoryPlannerROS::global_plan_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::initialized_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::latch_xy_goal_tolerance_ |
|
private |
The map grid visualizer for outputting the potential field generated by the cost function.
Definition at line 201 of file trajectory_planner_ros.h.
double base_local_planner::TrajectoryPlannerROS::max_sensor_range_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::max_vel_th_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::min_in_place_vel_th_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::min_vel_th_ |
|
private |
boost::recursive_mutex base_local_planner::TrajectoryPlannerROS::odom_lock_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::prune_plan_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::reached_goal_ |
|
private |
std::string base_local_planner::TrajectoryPlannerROS::robot_base_frame_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::rot_stopped_velocity_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::rotating_to_goal_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::setup_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::sim_period_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::trans_stopped_velocity_ |
|
private |
WorldModel* base_local_planner::TrajectoryPlannerROS::world_model_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::xy_goal_tolerance_ |
|
private |
bool base_local_planner::TrajectoryPlannerROS::xy_tolerance_latch_ |
|
private |
double base_local_planner::TrajectoryPlannerROS::yaw_goal_tolerance_ |
|
private |
The documentation for this class was generated from the following files: