#include <ros/ros.h>#include <tf/transform_broadcaster.h>#include <geometry_msgs/Twist.h>#include <geometry_msgs/Pose2D.h>#include <stdr_msgs/KinematicMsg.h>#include <ctime>

Go to the source code of this file.
Classes | |
| class | stdr_robot::MotionController |
| Abstract class that provides motion controller abstraction. More... | |
Namespaces | |
| stdr_robot | |
| The main namespace for STDR Robot. | |
Typedefs | |
| typedef boost::shared_ptr< MotionController > | stdr_robot::MotionControllerPtr |