#include <ros/ros.h>#include <nodelet/nodelet.h>#include <tf/transform_broadcaster.h>#include <stdr_msgs/RobotMsg.h>#include <stdr_msgs/MoveRobot.h>#include <stdr_robot/sensors/sensor_base.h>#include <stdr_robot/sensors/laser.h>#include <stdr_robot/sensors/sonar.h>#include <stdr_robot/sensors/rfid_reader.h>#include <stdr_robot/sensors/co2.h>#include <stdr_robot/sensors/microphone.h>#include <stdr_robot/sensors/thermal.h>#include <stdr_robot/motion/motion_controller_base.h>#include <stdr_robot/motion/ideal_motion_controller.h>#include <stdr_robot/motion/omni_motion_controller.h>#include <nav_msgs/OccupancyGrid.h>#include <nav_msgs/Odometry.h>#include <actionlib/client/simple_action_client.h>#include <stdr_msgs/RegisterRobotAction.h>

Go to the source code of this file.
Classes | |
| class | stdr_robot::Robot |
| Represents one robot in STDR. Inherts publicly from nodelet::Nodelet. More... | |
Namespaces | |
| namespace | stdr_robot |
The main namespace for STDR Robot. | |
Typedefs | |
| typedef actionlib::SimpleActionClient < stdr_msgs::RegisterRobotAction > | stdr_robot::RegisterRobotClient |
| typedef boost::shared_ptr < RegisterRobotClient > | stdr_robot::RegisterRobotClientPtr |