Public Member Functions | |
| int | init () |
| PlatformCtrlNode () | |
| void | receiveCmd (const geometry_msgs::Twist &twist) |
| void | receiveOdo (const sensor_msgs::JointState &js) |
| virtual | ~PlatformCtrlNode () |
Public Attributes | |
| ros::NodeHandle | n |
| tf::TransformBroadcaster | odom_broadcaster |
| ros::Publisher | topicPub_DriveCommands |
| ros::Publisher | topicPub_Odometry |
| ros::Subscriber | topicSub_ComVel |
| ros::Subscriber | topicSub_DriveState |
Private Attributes | |
| Kinematics * | kin |
| boost::mutex | mutex |
| OdomPose | p |
| bool | sendTransform |
Definition at line 43 of file neo_platformctrl_node.cpp.
Definition at line 65 of file neo_platformctrl_node.cpp.
| PlatformCtrlNode::~PlatformCtrlNode | ( | ) | [virtual] |
Definition at line 70 of file neo_platformctrl_node.cpp.
| int PlatformCtrlNode::init | ( | ) |
Definition at line 76 of file neo_platformctrl_node.cpp.
| void PlatformCtrlNode::receiveCmd | ( | const geometry_msgs::Twist & | twist | ) |
Definition at line 127 of file neo_platformctrl_node.cpp.
| void PlatformCtrlNode::receiveOdo | ( | const sensor_msgs::JointState & | js | ) |
Definition at line 136 of file neo_platformctrl_node.cpp.
Kinematics* PlatformCtrlNode::kin [private] |
Definition at line 61 of file neo_platformctrl_node.cpp.
boost::mutex PlatformCtrlNode::mutex [private] |
Definition at line 59 of file neo_platformctrl_node.cpp.
Definition at line 48 of file neo_platformctrl_node.cpp.
Definition at line 53 of file neo_platformctrl_node.cpp.
OdomPose PlatformCtrlNode::p [private] |
Definition at line 60 of file neo_platformctrl_node.cpp.
bool PlatformCtrlNode::sendTransform [private] |
Definition at line 62 of file neo_platformctrl_node.cpp.
Definition at line 51 of file neo_platformctrl_node.cpp.
Definition at line 49 of file neo_platformctrl_node.cpp.
Definition at line 52 of file neo_platformctrl_node.cpp.
Definition at line 50 of file neo_platformctrl_node.cpp.