36 #ifndef OMNI_MOTION_CONTROLLER_H 37 #define OMNI_MOTION_CONTROLLER_H 67 const geometry_msgs::Pose2D& pose,
70 const std::string& name,
71 const stdr_msgs::KinematicMsg params);
The main namespace for STDR Robot.
A class that provides motion controller implementation. \ Inherits publicly MotionController.
void calculateMotion(const ros::TimerEvent &event)
Calculates the motion - updates the robot pose.
Abstract class that provides motion controller abstraction.
OmniMotionController(const geometry_msgs::Pose2D &pose, tf::TransformBroadcaster &tf, ros::NodeHandle &n, const std::string &name, const stdr_msgs::KinematicMsg params)
Default constructor.
~OmniMotionController(void)
Default destructor.