#include <ros/ros.h>#include <tf/transform_listener.h>#include <nav_msgs/OccupancyGrid.h>#include <geometry_msgs/Pose2D.h>

Go to the source code of this file.
Classes | |
| class | stdr_robot::Sensor |
| A class that provides sensor abstraction. More... | |
Namespaces | |
| namespace | stdr_robot |
The main namespace for STDR Robot. | |
Typedefs | |
| typedef boost::shared_ptr< Sensor > | stdr_robot::SensorPtr |
| typedef std::vector< SensorPtr > | stdr_robot::SensorPtrVector |