Public Member Functions | Private Member Functions | Private Attributes | List of all members
dwa_local_planner::DWAPlannerROS Class Reference

ROS Wrapper for the DWAPlanner that adheres to the BaseLocalPlanner interface and can be used as a plugin for move_base. More...

#include <dwa_planner_ros.h>

Inheritance diagram for dwa_local_planner::DWAPlannerROS:
Inheritance graph
[legend]

Public Member Functions

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...
 
bool dwaComputeVelocityCommands (tf::Stamped< tf::Pose > &global_pose, geometry_msgs::Twist &cmd_vel)
 Given the current position, orientation, and velocity of the robot, compute velocity commands to send to the base, using dynamic window approach. More...
 
 DWAPlannerROS ()
 Constructor for DWAPlannerROS wrapper. 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 ()
 
bool setPlan (const std::vector< geometry_msgs::PoseStamped > &orig_global_plan)
 Set the plan that the controller is following. More...
 
 ~DWAPlannerROS ()
 Destructor for the wrapper. More...
 
- Public Member Functions inherited from nav_core::BaseLocalPlanner
virtual ~BaseLocalPlanner ()
 

Private Member Functions

void publishGlobalPlan (std::vector< geometry_msgs::PoseStamped > &path)
 
void publishLocalPlan (std::vector< geometry_msgs::PoseStamped > &path)
 
void reconfigureCB (DWAPlannerConfig &config, uint32_t level)
 Callback to update the local planner's parameters based on dynamic reconfigure. More...
 

Private Attributes

costmap_2d::Costmap2DROScostmap_ros_
 
tf::Stamped< tf::Posecurrent_pose_
 
dwa_local_planner::DWAPlannerConfig default_config_
 
boost::shared_ptr< DWAPlannerdp_
 The trajectory controller. More...
 
dynamic_reconfigure::Server< DWAPlannerConfig > * dsrv_
 
ros::Publisher g_plan_pub_
 
bool initialized_
 
ros::Publisher l_plan_pub_
 
base_local_planner::LatchedStopRotateController latchedStopRotateController_
 
base_local_planner::OdometryHelperRos odom_helper_
 
std::string odom_topic_
 
base_local_planner::LocalPlannerUtil planner_util_
 
bool setup_
 
tf::TransformListenertf_
 Used for transforming point clouds. More...
 

Additional Inherited Members

- Protected Member Functions inherited from nav_core::BaseLocalPlanner
 BaseLocalPlanner ()
 

Detailed Description

ROS Wrapper for the DWAPlanner that adheres to the BaseLocalPlanner interface and can be used as a plugin for move_base.

Definition at line 66 of file dwa_planner_ros.h.

Constructor & Destructor Documentation

dwa_local_planner::DWAPlannerROS::DWAPlannerROS ( )

Constructor for DWAPlannerROS wrapper.

Definition at line 89 of file dwa_planner_ros.cpp.

dwa_local_planner::DWAPlannerROS::~DWAPlannerROS ( )

Destructor for the wrapper.

Definition at line 172 of file dwa_planner_ros.cpp.

Member Function Documentation

bool dwa_local_planner::DWAPlannerROS::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_velWill 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 254 of file dwa_planner_ros.cpp.

bool dwa_local_planner::DWAPlannerROS::dwaComputeVelocityCommands ( tf::Stamped< tf::Pose > &  global_pose,
geometry_msgs::Twist &  cmd_vel 
)

Given the current position, orientation, and velocity of the robot, compute velocity commands to send to the base, using dynamic window approach.

Parameters
cmd_velWill be filled with the velocity command to be passed to the robot base
Returns
True if a valid trajectory was found, false otherwise

Definition at line 179 of file dwa_planner_ros.cpp.

void dwa_local_planner::DWAPlannerROS::initialize ( std::string  name,
tf::TransformListener tf,
costmap_2d::Costmap2DROS costmap_ros 
)
virtual

Constructs the ros wrapper.

Parameters
nameThe name to give this instance of the trajectory planner
tfA pointer to a transform listener
costmapThe cost map to use for assigning costs to trajectories

Implements nav_core::BaseLocalPlanner.

Definition at line 94 of file dwa_planner_ros.cpp.

bool dwa_local_planner::DWAPlannerROS::isGoalReached ( )
virtual

Check if the goal pose has been achieved.

Returns
True if achieved, false otherwise

Implements nav_core::BaseLocalPlanner.

Definition at line 145 of file dwa_planner_ros.cpp.

bool dwa_local_planner::DWAPlannerROS::isInitialized ( )
inline

Definition at line 119 of file dwa_planner_ros.h.

void dwa_local_planner::DWAPlannerROS::publishGlobalPlan ( std::vector< geometry_msgs::PoseStamped > &  path)
private

Definition at line 168 of file dwa_planner_ros.cpp.

void dwa_local_planner::DWAPlannerROS::publishLocalPlan ( std::vector< geometry_msgs::PoseStamped > &  path)
private

Definition at line 163 of file dwa_planner_ros.cpp.

void dwa_local_planner::DWAPlannerROS::reconfigureCB ( DWAPlannerConfig &  config,
uint32_t  level 
)
private

Callback to update the local planner's parameters based on dynamic reconfigure.

Definition at line 54 of file dwa_planner_ros.cpp.

bool dwa_local_planner::DWAPlannerROS::setPlan ( const std::vector< geometry_msgs::PoseStamped > &  orig_global_plan)
virtual

Set the plan that the controller is following.

Parameters
orig_global_planThe plan to pass to the controller
Returns
True if the plan was updated successfully, false otherwise

Implements nav_core::BaseLocalPlanner.

Definition at line 133 of file dwa_planner_ros.cpp.

Member Data Documentation

costmap_2d::Costmap2DROS* dwa_local_planner::DWAPlannerROS::costmap_ros_
private

Definition at line 142 of file dwa_planner_ros.h.

tf::Stamped<tf::Pose> dwa_local_planner::DWAPlannerROS::current_pose_
private

Definition at line 147 of file dwa_planner_ros.h.

dwa_local_planner::DWAPlannerConfig dwa_local_planner::DWAPlannerROS::default_config_
private

Definition at line 145 of file dwa_planner_ros.h.

boost::shared_ptr<DWAPlanner> dwa_local_planner::DWAPlannerROS::dp_
private

The trajectory controller.

Definition at line 140 of file dwa_planner_ros.h.

dynamic_reconfigure::Server<DWAPlannerConfig>* dwa_local_planner::DWAPlannerROS::dsrv_
private

Definition at line 144 of file dwa_planner_ros.h.

ros::Publisher dwa_local_planner::DWAPlannerROS::g_plan_pub_
private

Definition at line 136 of file dwa_planner_ros.h.

bool dwa_local_planner::DWAPlannerROS::initialized_
private

Definition at line 152 of file dwa_planner_ros.h.

ros::Publisher dwa_local_planner::DWAPlannerROS::l_plan_pub_
private

Definition at line 136 of file dwa_planner_ros.h.

base_local_planner::LatchedStopRotateController dwa_local_planner::DWAPlannerROS::latchedStopRotateController_
private

Definition at line 149 of file dwa_planner_ros.h.

base_local_planner::OdometryHelperRos dwa_local_planner::DWAPlannerROS::odom_helper_
private

Definition at line 155 of file dwa_planner_ros.h.

std::string dwa_local_planner::DWAPlannerROS::odom_topic_
private

Definition at line 156 of file dwa_planner_ros.h.

base_local_planner::LocalPlannerUtil dwa_local_planner::DWAPlannerROS::planner_util_
private

Definition at line 138 of file dwa_planner_ros.h.

bool dwa_local_planner::DWAPlannerROS::setup_
private

Definition at line 146 of file dwa_planner_ros.h.

tf::TransformListener* dwa_local_planner::DWAPlannerROS::tf_
private

Used for transforming point clouds.

Definition at line 133 of file dwa_planner_ros.h.


The documentation for this class was generated from the following files:


dwa_local_planner
Author(s): Eitan Marder-Eppstein, contradict@gmail.com
autogenerated on Thu Jan 21 2021 04:05:59