Public Member Functions | Protected Member Functions | Protected Attributes
MotionGenerator Class Reference

List of all members.

Public Member Functions

 MotionGenerator ()

Protected Member Functions

void twist_callback (const geometry_msgs::TwistConstPtr &)

Protected Attributes

ros::NodeHandle nh_
ros::Publisher pub_
double radius_
ros::Subscriber sub_
double width_

Detailed Description

Manages a single subscription to Twist messages, produces a Grizzly Drive message with the appropriate individual wheel speeds.

Definition at line 34 of file motion_generator_node.cpp.


Constructor & Destructor Documentation

Definition at line 37 of file motion_generator_node.cpp.


Member Function Documentation

void MotionGenerator::twist_callback ( const geometry_msgs::TwistConstPtr &  twist) [protected]

Open-loop mapping between linear/angular commands and individual wheel speed commands. Currently very naive, but in the future may provide some further intelligence, though not closed-loop control.

Definition at line 60 of file motion_generator_node.cpp.


Member Data Documentation

Definition at line 49 of file motion_generator_node.cpp.

Definition at line 50 of file motion_generator_node.cpp.

double MotionGenerator::radius_ [protected]

Definition at line 52 of file motion_generator_node.cpp.

Definition at line 51 of file motion_generator_node.cpp.

double MotionGenerator::width_ [protected]

Definition at line 52 of file motion_generator_node.cpp.


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


grizzly_motion
Author(s):
autogenerated on Fri Aug 28 2015 10:55:30