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 REALSENSE_LEFT_LIMIT 1.30 20 #define REALSENSE_RIGHT_LIMIT -1.30 21 #define REALSENSE_CENTER_POSITION 0.0 23 #define POS_TOLERANCE 0.05 ros::ServiceClient _reset_realsense_position_client
ros::Subscriber _joint_states_subscriber
void onExplorationStart(bool &success, std::string &message)
void onWaypointFollowingStop(bool &success, std::string &message)
int _navigation_completed_status
void jointStateCallback(sensor_msgs::JointState::ConstPtr joint_state)
void onWaypointFollowingStart(bool &success, std::string &message)
void onInterrupt(int interrupt)
Called when an operation mode interrupt was received.
Dummy state for mapping at a reached goal during exploration. Only initiates transition to CalculateG...
ros::Publisher _realsense_joint_controller
ros::ServiceClient _navigation_goal_completed_service
void onExplorationStop(bool &success, std::string &message)