Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
MecanumControllerNode Class Reference

Public Member Functions

 MecanumControllerNode ()
 

Protected Member Functions

void jointStateCallback (const sensor_msgs::JointState msg)
 
void twistCallback (const geometry_msgs::Twist msg)
 

Protected Attributes

std::shared_ptr< cob_mecanum_controller::MecanumControllercontroller_
 
ros::Publisher joint_cmd_pub_
 
ros::Subscriber joint_state_sub_
 
ros::NodeHandle nh_
 
std::string odom_frame_
 
ros::Publisher odom_pub_
 
std::string static_frame_
 
ros::Subscriber twist_sub_
 

Detailed Description

Definition at line 24 of file mecanum_controller_node.cpp.

Constructor & Destructor Documentation

MecanumControllerNode::MecanumControllerNode ( )
inline

Definition at line 27 of file mecanum_controller_node.cpp.

Member Function Documentation

void MecanumControllerNode::jointStateCallback ( const sensor_msgs::JointState  msg)
inlineprotected

Definition at line 92 of file mecanum_controller_node.cpp.

void MecanumControllerNode::twistCallback ( const geometry_msgs::Twist  msg)
inlineprotected

Definition at line 81 of file mecanum_controller_node.cpp.

Member Data Documentation

std::shared_ptr<cob_mecanum_controller::MecanumController> MecanumControllerNode::controller_
protected

Definition at line 76 of file mecanum_controller_node.cpp.

ros::Publisher MecanumControllerNode::joint_cmd_pub_
protected

Definition at line 75 of file mecanum_controller_node.cpp.

ros::Subscriber MecanumControllerNode::joint_state_sub_
protected

Definition at line 72 of file mecanum_controller_node.cpp.

ros::NodeHandle MecanumControllerNode::nh_
protected

Definition at line 70 of file mecanum_controller_node.cpp.

std::string MecanumControllerNode::odom_frame_
protected

Definition at line 79 of file mecanum_controller_node.cpp.

ros::Publisher MecanumControllerNode::odom_pub_
protected

Definition at line 74 of file mecanum_controller_node.cpp.

std::string MecanumControllerNode::static_frame_
protected

Definition at line 78 of file mecanum_controller_node.cpp.

ros::Subscriber MecanumControllerNode::twist_sub_
protected

Definition at line 71 of file mecanum_controller_node.cpp.


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


cob_mecanum_controller
Author(s):
autogenerated on Thu Apr 8 2021 02:39:42