Public Member Functions
stdr_robot::OmniMotionController Class Reference

A class that provides motion controller implementation. \ Inherits publicly MotionController. More...

#include <omni_motion_controller.h>

Inheritance diagram for stdr_robot::OmniMotionController:
Inheritance graph
[legend]

List of all members.

Public Member Functions

void calculateMotion (const ros::TimerEvent &event)
 Calculates the motion - updates the robot pose.
 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.

Detailed Description

A class that provides motion controller implementation. \ Inherits publicly MotionController.

Definition at line 53 of file omni_motion_controller.h.


Constructor & Destructor Documentation

stdr_robot::OmniMotionController::OmniMotionController ( const geometry_msgs::Pose2D &  pose,
tf::TransformBroadcaster tf,
ros::NodeHandle n,
const std::string &  name,
const stdr_msgs::KinematicMsg  params 
)

Default constructor.

Parameters:
pose[const geometry_msgs::Pose2D&] The robot pose
tf[tf::TransformBroadcaster&] A ROS tf broadcaster
n[ros::NodeHandle&] The ROS node handle
name[const std::string&] The robot frame id
Returns:
void

Definition at line 48 of file omni_motion_controller.cpp.

Default destructor.

Returns:
void

Definition at line 97 of file omni_motion_controller.cpp.


Member Function Documentation

Calculates the motion - updates the robot pose.

Parameters:
event[const ros::TimerEvent&] A ROS timer event
Returns:
void

< updates _posePtr based on _currentTwist and time passed (event.last_real)

Implements stdr_robot::MotionController.

Definition at line 68 of file omni_motion_controller.cpp.


The documentation for this class was generated from the following files:


stdr_robot
Author(s): Manos Tsardoulias, Chris Zalidis, Aris Thallas
autogenerated on Thu Jun 6 2019 18:57:28