#include <ros/ros.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseArray.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <std_srvs/SetBool.h>
#include <geometry_msgs/Twist.h>
#include <std_srvs/Trigger.h>
#include <std_msgs/Float64.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/server/simple_action_server.h>
#include <std_msgs/Bool.h>
#include <rsm_msgs/GetNavigationGoal.h>
#include <rsm_msgs/GoalCompleted.h>
Go to the source code of this file.
|
class | rsm::AdditionsServiceProvider |
| Class that establishes communication between the different states and the RSM's periphery including the GUI for the states and classes defined in rsm_additions package. It offers services and publishes topics based on the variables that need to be saved during state transitions. More...
|
|