25 #include <stdr_msgs/RobotIndexedMsg.h> 26 #include <stdr_msgs/SpawnRobotAction.h> 27 #include <stdr_msgs/DeleteRobotAction.h> 28 #include <stdr_msgs/MoveRobot.h> 30 #include <geometry_msgs/Pose2D.h> 32 #ifndef HANDLE_ROBOT_H 33 #define HANDLE_ROBOT_H 73 stdr_msgs::RobotIndexedMsg
spawnNewRobot(
const stdr_msgs::RobotMsg msg);
89 const geometry_msgs::Pose2D newPose);
actionlib::SimpleActionClient< stdr_msgs::SpawnRobotAction > SpawnRobotClient
stdr_msgs::RobotIndexedMsg spawnNewRobot(const stdr_msgs::RobotMsg msg)
Spawns a new robot.
Handles the manipulation of robots (creation, deletion, move)
The main namespace for STDR Robot.
actionlib::SimpleActionClient< stdr_msgs::DeleteRobotAction > DeleteRobotClient
DeleteRobotClient _deleteRobotClient
SpawnRobotClient _spawnRobotClient
< Action client for spawning robots
bool deleteRobot(const std::string &name)
Deletes a robot by frame_id.
bool moveRobot(const std::string &name, const geometry_msgs::Pose2D newPose)
Re-places a robot by frame_id.
HandleRobot()
Default constructor.