#include <joint_commander.h>
Public Member Functions | |
JointCommander () | |
void | loop_once () |
void | update_config (calvin_joint_commander::JointCommanderConfig &new_config, uint32_t level=0) |
virtual | ~JointCommander () |
Private Attributes | |
JointCommanderConfig | config_ |
dynamic_reconfigure::Server < calvin_joint_commander::JointCommanderConfig > | dynamic_reconfigure_server_ |
ros::Publisher | joint_states_pub_ |
ros::Publisher | kinect_pitch_controller_pub_ |
ros::NodeHandle | nh_ |
ros::Publisher | webcam_pitch_controller_pub_ |
Definition at line 39 of file joint_commander.h.
Definition at line 30 of file joint_commander.cpp.
calvin_joint_commander::JointCommander::~JointCommander | ( | ) | [virtual] |
Definition at line 42 of file joint_commander.cpp.
Definition at line 51 of file joint_commander.cpp.
void calvin_joint_commander::JointCommander::update_config | ( | calvin_joint_commander::JointCommanderConfig & | new_config, |
uint32_t | level = 0 |
||
) |
Definition at line 46 of file joint_commander.cpp.
JointCommanderConfig calvin_joint_commander::JointCommander::config_ [private] |
Definition at line 55 of file joint_commander.h.
dynamic_reconfigure::Server<calvin_joint_commander::JointCommanderConfig> calvin_joint_commander::JointCommander::dynamic_reconfigure_server_ [private] |
Definition at line 56 of file joint_commander.h.
Definition at line 52 of file joint_commander.h.
Definition at line 50 of file joint_commander.h.
Definition at line 49 of file joint_commander.h.
Definition at line 51 of file joint_commander.h.