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_ |
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.
MotionGenerator::MotionGenerator | ( | ) | [inline] |
Definition at line 37 of file motion_generator_node.cpp.
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.
ros::NodeHandle MotionGenerator::nh_ [protected] |
Definition at line 49 of file motion_generator_node.cpp.
ros::Publisher MotionGenerator::pub_ [protected] |
Definition at line 50 of file motion_generator_node.cpp.
double MotionGenerator::radius_ [protected] |
Definition at line 52 of file motion_generator_node.cpp.
ros::Subscriber MotionGenerator::sub_ [protected] |
Definition at line 51 of file motion_generator_node.cpp.
double MotionGenerator::width_ [protected] |
Definition at line 52 of file motion_generator_node.cpp.