15 "kinect_controller/command", 1,
true);
18 "resetKinectPosition");
20 rsm_msgs::GoalCompleted>(
"navigationGoalCompleted");
21 _name =
"E: Kinect Mapping";
41 std_msgs::Float64 kinect_command;
57 std_msgs::Float64 kinect_command;
74 std_msgs::Float64 kinect_command;
90 std_srvs::Trigger srv;
92 ROS_ERROR(
"Failed to call Reset Kinect Position service");
95 rsm_msgs::GoalCompleted srv;
98 ROS_ERROR(
"Failed to call Complete Navigation Goal service");
103 std::string &message) {
105 message =
"Exploration running";
109 std::string &message) {
111 message =
"Exploration stopped";
116 std::string &message) {
118 message =
"Exploration running";
122 std::string &message) {
124 message =
"Exploration running";
131 boost::make_shared<EmergencyStopState>());
136 boost::make_shared<TeleoperationState>());
148 sensor_msgs::JointState::ConstPtr joint_state) {
164 && joint_state->position[0]
int _navigation_completed_status
void publish(const boost::shared_ptr< M > &message) const
boost::shared_ptr< rsm::BaseState > getPluginState(int plugin_type, std::string routine="")
Dummy state for mapping at a reached goal during exploration. Only initiates transition to CalculateG...
ros::ServiceClient _reset_kinect_position_client
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
ros::Publisher _kinect_joint_controller
ros::ServiceClient _navigation_goal_completed_service
bool call(MReq &req, MRes &res)
void transitionToVolatileState(boost::shared_ptr< rsm::BaseState > next_state)
void onWaypointFollowingStart(bool &success, std::string &message)
#define TELEOPERATION_INTERRUPT
ros::Subscriber _joint_states_subscriber
#define KINECT_CENTER_POSITION
#define CALCULATEGOAL_STATE
StateInterface * _stateinterface
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void onExplorationStop(bool &success, std::string &message)
#define EMERGENCY_STOP_INTERRUPT
#define KINECT_LEFT_LIMIT
void onInterrupt(int interrupt)
Called when an operation mode interrupt was received.
#define KINECT_RIGHT_LIMIT
#define SIMPLE_GOAL_INTERRUPT
void onExplorationStart(bool &success, std::string &message)
ROSCPP_DECL void spinOnce()
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
void onWaypointFollowingStop(bool &success, std::string &message)
void jointStateCallback(sensor_msgs::JointState::ConstPtr joint_state)