#include <rsm_msgs/OperationMode.h>
#include <rsm_msgs/SetNavigationGoal.h>
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseStamped.h>
#include <std_msgs/String.h>
#include <std_srvs/SetBool.h>
#include <std_srvs/Trigger.h>
#include <pluginlib/class_loader.h>
#include <rsm_core/BaseState.h>
#include <rsm_core/IdleState.h>
Go to the source code of this file.
|
class | rsm::StateInterface |
| Handles the RSM transitions between the different state classes and holds a reference to the current and the upcoming state class. More...
|
|
#define CALCULATEGOAL_STATE 1 |
#define NAVIGATION_STATE 2 |