10 #include <rsm_msgs/GoalCompleted.h> 11 #include <sensor_msgs/JointState.h> 12 #include <std_msgs/Float64.h> 13 #include <std_srvs/Trigger.h> 17 #define MOVE_TO_CENTER 2 19 #define KINECT_LEFT_LIMIT 1.30 20 #define KINECT_RIGHT_LIMIT -1.30 21 #define KINECT_CENTER_POSITION 0.0 23 #define POS_TOLERANCE 0.05 int _navigation_completed_status
Dummy state for mapping at a reached goal during exploration. Only initiates transition to CalculateG...
ros::ServiceClient _reset_kinect_position_client
ros::Publisher _kinect_joint_controller
ros::ServiceClient _navigation_goal_completed_service
void onWaypointFollowingStart(bool &success, std::string &message)
ros::Subscriber _joint_states_subscriber
void onExplorationStop(bool &success, std::string &message)
void onInterrupt(int interrupt)
Called when an operation mode interrupt was received.
void onExplorationStart(bool &success, std::string &message)
void onWaypointFollowingStop(bool &success, std::string &message)
void jointStateCallback(sensor_msgs::JointState::ConstPtr joint_state)