#include <pluginlib/class_list_macros.h>
#include <rsm_core/BaseState.h>
#include <rsm_core/IdleState.h>
#include <rsm_core/EmergencyStopState.h>
#include <rsm_core/StateInterface.h>
#include <geometry_msgs/PoseArray.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/client/simple_action_client.h>
#include <rsm_msgs/GetNavigationGoal.h>
#include <rsm_msgs/GetRobotPose.h>
#include <rsm_msgs/OperationMode.h>
#include <rsm_msgs/GoalCompleted.h>
#include <std_srvs/Trigger.h>
#include <tf/transform_datatypes.h>
#include <std_msgs/Bool.h>
Go to the source code of this file.
|
class | rsm::NavigationState |
| State being active when the robot should move to a previously set goal. First obtains the goal and then tries to reach it using the Move Base package. State is exited when the goal was reached, aborted or an interrupt occured. More...
|
|
#define POSE_TOLERANCE 0.05 |