#include <boost/thread/thread.hpp>#include <bwi_interruptable_action_server/interruptable_action_server.h>#include <move_base_msgs/MoveBaseAction.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>#include <nav_msgs/GetPlan.h>#include <ros/ros.h>#include <std_srvs/Empty.h>
Go to the source code of this file.
Functions | |
| void | locationHandler (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &pose) |
| int | main (int argc, char *argv[]) |
| void | newGoalCallback (const InterruptableActionServer< move_base_msgs::MoveBaseAction >::GoalConstPtr &new_goal) |
Variables | |
| boost::shared_ptr < ros::ServiceClient > | clear_costmap_service_ |
| geometry_msgs::PoseStamped | current_location_ |
| bool | first_location_available_ = false |
| boost::shared_ptr < ros::Subscriber > | location_subscriber_ |
| boost::shared_ptr < ros::ServiceClient > | make_plan_service_ |
| void locationHandler | ( | const geometry_msgs::PoseWithCovarianceStamped::ConstPtr & | pose | ) |
Definition at line 17 of file move_base_interruptable_server.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 48 of file move_base_interruptable_server.cpp.
| void newGoalCallback | ( | const InterruptableActionServer< move_base_msgs::MoveBaseAction >::GoalConstPtr & | new_goal | ) |
Definition at line 23 of file move_base_interruptable_server.cpp.
| boost::shared_ptr<ros::ServiceClient> clear_costmap_service_ |
Definition at line 11 of file move_base_interruptable_server.cpp.
| geometry_msgs::PoseStamped current_location_ |
Definition at line 15 of file move_base_interruptable_server.cpp.
| bool first_location_available_ = false |
Definition at line 14 of file move_base_interruptable_server.cpp.
| boost::shared_ptr<ros::Subscriber> location_subscriber_ |
Definition at line 13 of file move_base_interruptable_server.cpp.
| boost::shared_ptr<ros::ServiceClient> make_plan_service_ |
Definition at line 12 of file move_base_interruptable_server.cpp.