#include <passive_joint_publisher.h>
Public Member Functions | |
PassiveJointPublisher (ros::NodeHandle &nh, ros::V_string &joints, int frequency) | |
void | timerCb (const ros::TimerEvent &) |
Private Attributes | |
sensor_msgs::JointState | msg_ |
ros::Publisher | pub_ |
ros::Timer | timer_ |
Definition at line 43 of file passive_joint_publisher.h.
ridgeback_base::PassiveJointPublisher::PassiveJointPublisher | ( | ros::NodeHandle & | nh, |
ros::V_string & | joints, | ||
int | frequency | ||
) | [inline] |
Definition at line 46 of file passive_joint_publisher.h.
void ridgeback_base::PassiveJointPublisher::timerCb | ( | const ros::TimerEvent & | ) | [inline] |
Definition at line 59 of file passive_joint_publisher.h.
sensor_msgs::JointState ridgeback_base::PassiveJointPublisher::msg_ [private] |
Definition at line 66 of file passive_joint_publisher.h.
Definition at line 67 of file passive_joint_publisher.h.
Definition at line 68 of file passive_joint_publisher.h.