22 #ifndef IDEAL_MOTION_CONTROLLER_H 23 #define IDEAL_MOTION_CONTROLLER_H 52 const geometry_msgs::Pose2D& pose,
55 const std::string& name,
56 const stdr_msgs::KinematicMsg params);
The main namespace for STDR Robot.
void calculateMotion(const ros::TimerEvent &event)
Calculates the motion - updates the robot pose.
~IdealMotionController(void)
Default destructor.
Abstract class that provides motion controller abstraction.
IdealMotionController(const geometry_msgs::Pose2D &pose, tf::TransformBroadcaster &tf, ros::NodeHandle &n, const std::string &name, const stdr_msgs::KinematicMsg params)
Default constructor.
A class that provides motion controller implementation. Inherits publicly MotionController.