35 const geometry_msgs::Pose2D& pose,
38 const std::string& name,
39 const stdr_msgs::KinematicMsg params)
ros::Duration _freq
ROS timer for generating motion calculation events.
ros::Timer _calcTimer
Broadcaster of the robot tf transform.
The main namespace for STDR Robot.
geometry_msgs::Pose2D _pose
Current motion command.
void calculateMotion(const ros::TimerEvent &event)
Calculates the motion - updates the robot pose.
~IdealMotionController(void)
Default destructor.
geometry_msgs::Twist _currentTwist
The kinematic model parameters.
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
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.