3 #include <geometry_msgs/Pose.h> 4 #include <geometry_msgs/PoseArray.h> 5 #include <visualization_msgs/Marker.h> 6 #include <visualization_msgs/MarkerArray.h> 8 #include <std_srvs/SetBool.h> 9 #include <geometry_msgs/Twist.h> 11 #include <std_srvs/Trigger.h> 12 #include <std_msgs/Float64.h> 14 #include <move_base_msgs/MoveBaseAction.h> 17 #include <std_msgs/Bool.h> 18 #include <rsm_msgs/GetNavigationGoal.h> 19 #include <rsm_msgs/GoalCompleted.h> 97 std_srvs::SetBool::Response &res);
103 const geometry_msgs::Twist::ConstPtr& cmd_vel);
110 const move_base_msgs::MoveBaseGoalConstPtr& frontier_goal);
118 const visualization_msgs::MarkerArray::ConstPtr& frontiers);
137 const rsm_msgs::GoalStatus::ConstPtr& goal_status);
143 const std_msgs::Bool::ConstPtr& exploration_mode);
151 std_srvs::Trigger::Response &res);
void explorationModeCallback(const std_msgs::Bool::ConstPtr &exploration_mode)
ros::ServiceServer _reset_kinect_position_serivce
geometry_msgs::PoseArray _exploration_goals
void explorationGoalCallback(const rsm_msgs::GoalStatus::ConstPtr &goal_status)
ros::Publisher _failed_goals_publisher
ros::Subscriber _reverse_mode_cmd_vel_subscriber
ros::Publisher _kinect_joint_controller
ros::Publisher _exploration_goals_publisher
void frontierCallback(const visualization_msgs::MarkerArray::ConstPtr &frontiers)
void reverseModeCmdVelCallback(const geometry_msgs::Twist::ConstPtr &cmd_vel)
ros::ServiceClient _get_navigation_goal_service
std::string _autonomy_cmd_vel_topic
bool navGoalIncludedInFrontiers()
ros::Subscriber _exploration_mode_subscriber
void cmdVelCallback(const geometry_msgs::Twist::ConstPtr &msg)
ros::Publisher _reverse_mode_cmd_vel_publisher
AdditionsServiceProvider()
ros::ServiceServer _set_navigation_to_reverse_service
double _exploration_goal_tolerance
ros::Subscriber _exploration_goal_subscriber
ros::Subscriber frontiers_marker_array_subscriber
MoveBaseActionServer * as
void publishExplorationGoals()
void publishFailedGoals()
ros::Publisher _goal_obsolete_publisher
void publishGoalObsolete()
~AdditionsServiceProvider()
Class that establishes communication between the different states and the RSM's periphery including t...
actionlib::SimpleActionServer< move_base_msgs::MoveBaseAction > MoveBaseActionServer
void navigationGoalCallback(const move_base_msgs::MoveBaseGoalConstPtr &frontier_goal)
geometry_msgs::PoseArray _failed_goals
bool setNavigationToReverse(std_srvs::SetBool::Request &req, std_srvs::SetBool::Response &res)
bool _calculate_goal_plugin_used
bool resetKinectPosition(std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)