#include <ros/ros.h>#include <actionlib/client/simple_action_client.h>#include <actionlib/client/terminal_state.h>#include <stdr_msgs/RobotIndexedMsg.h>#include <stdr_msgs/SpawnRobotAction.h>#include <stdr_msgs/DeleteRobotAction.h>#include <stdr_msgs/MoveRobot.h>#include <stdr_robot/exceptions.h>#include <geometry_msgs/Pose2D.h>

Go to the source code of this file.
Classes | |
| class | stdr_robot::HandleRobot |
| Handles the manipulation of robots (creation, deletion, move) More... | |
Namespaces | |
| stdr_robot | |
| The main namespace for STDR Robot. | |
Typedefs | |
| typedef actionlib::SimpleActionClient< stdr_msgs::DeleteRobotAction > | stdr_robot::DeleteRobotClient |
| typedef actionlib::SimpleActionClient< stdr_msgs::SpawnRobotAction > | stdr_robot::SpawnRobotClient |