15 "realsense_controller/command", 1,
true);
18 "resetRealsensePosition");
20 rsm_msgs::GoalCompleted>(
"navigationGoalCompleted");
21 _name =
"E: RealSense Mapping";
41 std_msgs::Float64 realsense_command;
57 std_msgs::Float64 realsense_command;
74 std_msgs::Float64 realsense_command;
90 std_srvs::Trigger srv;
92 ROS_ERROR(
"Failed to call Reset Realsense Position service");
96 rsm_msgs::GoalCompleted srv;
98 srv.request.navigation_status =
false;
100 ROS_ERROR(
"Failed to call Complete Navigation Goal service");
106 std::string &message) {
108 message =
"Exploration running";
112 std::string &message) {
114 message =
"Exploration stopped";
119 std::string &message) {
121 message =
"Exploration running";
125 std::string &message) {
127 message =
"Exploration running";
134 boost::make_shared<EmergencyStopState>());
139 boost::make_shared<TeleoperationState>());
151 sensor_msgs::JointState::ConstPtr joint_state) {
166 if (joint_state->position[0]
168 && joint_state->position[0]
ros::ServiceClient _reset_realsense_position_client
boost::shared_ptr< rsm::BaseState > getPluginState(int plugin_type, std::string routine="")
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
ros::Subscriber _joint_states_subscriber
#define REALSENSE_RIGHT_LIMIT
void onExplorationStart(bool &success, std::string &message)
void onWaypointFollowingStop(bool &success, std::string &message)
int _navigation_completed_status
bool call(MReq &req, MRes &res)
void jointStateCallback(sensor_msgs::JointState::ConstPtr joint_state)
void transitionToVolatileState(boost::shared_ptr< rsm::BaseState > next_state)
#define TELEOPERATION_INTERRUPT
#define REALSENSE_CENTER_POSITION
void onWaypointFollowingStart(bool &success, std::string &message)
void publish(const boost::shared_ptr< M > &message) const
void onInterrupt(int interrupt)
Called when an operation mode interrupt was received.
#define CALCULATEGOAL_STATE
#define REALSENSE_LEFT_LIMIT
Dummy state for mapping at a reached goal during exploration. Only initiates transition to CalculateG...
StateInterface * _stateinterface
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
#define EMERGENCY_STOP_INTERRUPT
ros::Publisher _realsense_joint_controller
ros::ServiceClient _navigation_goal_completed_service
void onExplorationStop(bool &success, std::string &message)
#define SIMPLE_GOAL_INTERRUPT
ROSCPP_DECL void spinOnce()
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)