#include <ros/ros.h>
#include <rsm_msgs/Waypoint.h>
#include <rsm_msgs/WaypointArray.h>
#include <rsm_msgs/AddWaypoint.h>
#include <rsm_msgs/GetWaypoints.h>
#include <rsm_msgs/MoveWaypoint.h>
#include <rsm_msgs/RemoveWaypoint.h>
#include <rsm_msgs/WaypointVisited.h>
#include <rsm_msgs/WaypointUnreachable.h>
#include <rsm_msgs/SetWaypointFollowingMode.h>
#include <rsm_msgs/SetWaypointRoutine.h>
#include <rsm_msgs/GetWaypointRoutines.h>
#include <std_srvs/Trigger.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseArray.h>
#include <rsm_msgs/SetNavigationGoal.h>
#include <rsm_msgs/GetNavigationGoal.h>
#include <rsm_msgs/GoalCompleted.h>
#include <rsm_msgs/GoalStatus.h>
#include <rsm_msgs/GetRobotPose.h>
#include <tf/transform_listener.h>
#include <std_srvs/SetBool.h>
#include <std_msgs/Bool.h>
#include <geometry_msgs/PoseStamped.h>
Go to the source code of this file.
|
class | rsm::ServiceProvider |
| Establishes communication between the different states and the RSM's periphery including the GUI. It offers services and publishes topics based on the variables that need to be saved during state transitions. More...
|
|