37 #ifndef DWA_LOCAL_PLANNER_DWA_PLANNER_ROS_H_ 38 #define DWA_LOCAL_PLANNER_DWA_PLANNER_ROS_H_ 40 #include <boost/shared_ptr.hpp> 41 #include <boost/thread.hpp> 45 #include <dynamic_reconfigure/server.h> 46 #include <dwa_local_planner/DWAPlannerConfig.h> 50 #include <nav_msgs/Odometry.h> 109 bool setPlan(
const std::vector<geometry_msgs::PoseStamped>& orig_global_plan);
127 void reconfigureCB(DWAPlannerConfig &config, uint32_t level);
144 dynamic_reconfigure::Server<DWAPlannerConfig> *
dsrv_;
boost::shared_ptr< DWAPlanner > dp_
The trajectory controller.
void reconfigureCB(DWAPlannerConfig &config, uint32_t level)
Callback to update the local planner's parameters based on dynamic reconfigure.
dynamic_reconfigure::Server< DWAPlannerConfig > * dsrv_
void initialize(std::string name, tf::TransformListener *tf, costmap_2d::Costmap2DROS *costmap_ros)
Constructs the ros wrapper.
base_local_planner::OdometryHelperRos odom_helper_
base_local_planner::LatchedStopRotateController latchedStopRotateController_
ROS Wrapper for the DWAPlanner that adheres to the BaseLocalPlanner interface and can be used as a pl...
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...
tf::TransformListener * tf_
Used for transforming point clouds.
costmap_2d::Costmap2DROS * costmap_ros_
bool computeVelocityCommands(geometry_msgs::Twist &cmd_vel)
Given the current position, orientation, and velocity of the robot, compute velocity commands to send...
bool setPlan(const std::vector< geometry_msgs::PoseStamped > &orig_global_plan)
Set the plan that the controller is following.
dwa_local_planner::DWAPlannerConfig default_config_
ros::Publisher l_plan_pub_
void publishLocalPlan(std::vector< geometry_msgs::PoseStamped > &path)
void publishGlobalPlan(std::vector< geometry_msgs::PoseStamped > &path)
~DWAPlannerROS()
Destructor for the wrapper.
DWAPlannerROS()
Constructor for DWAPlannerROS wrapper.
ros::Publisher g_plan_pub_
bool isGoalReached()
Check if the goal pose has been achieved.
tf::Stamped< tf::Pose > current_pose_
base_local_planner::LocalPlannerUtil planner_util_