Public Member Functions | |
double | getPublishRate () const |
void | jointStateCallback (const sensor_msgs::JointStateConstPtr &jointState) |
JointStateDecumulator () | |
void | publishSeparateJointState () |
~JointStateDecumulator () | |
Private Attributes | |
std::string | group_name_ |
ros::Publisher | joint_state_publisher_ |
ros::Subscriber | joint_state_subscriber_ |
std::map< std::string, double > | joint_values_ |
std::map< std::string, double > | joint_velocities_ |
ros::NodeHandle | priv_handle_ |
double | publish_rate_ |
bool | publish_ungrouped_joints_ |
planning_environment::RobotModels * | robot_model_ |
ros::NodeHandle | root_handle_ |
std::map< std::string, bool > | ungrouped_joints_ |
Definition at line 7 of file joint_state_decumulator.cpp.
JointStateDecumulator::JointStateDecumulator | ( | ) | [inline] |
Definition at line 11 of file joint_state_decumulator.cpp.
JointStateDecumulator::~JointStateDecumulator | ( | ) | [inline] |
Definition at line 40 of file joint_state_decumulator.cpp.
double JointStateDecumulator::getPublishRate | ( | ) | const [inline] |
Definition at line 81 of file joint_state_decumulator.cpp.
void JointStateDecumulator::jointStateCallback | ( | const sensor_msgs::JointStateConstPtr & | jointState | ) | [inline] |
Definition at line 45 of file joint_state_decumulator.cpp.
void JointStateDecumulator::publishSeparateJointState | ( | ) | [inline] |
Definition at line 65 of file joint_state_decumulator.cpp.
std::string JointStateDecumulator::group_name_ [private] |
Definition at line 92 of file joint_state_decumulator.cpp.
Definition at line 96 of file joint_state_decumulator.cpp.
Definition at line 97 of file joint_state_decumulator.cpp.
std::map<std::string, double> JointStateDecumulator::joint_values_ [private] |
Definition at line 99 of file joint_state_decumulator.cpp.
std::map<std::string, double> JointStateDecumulator::joint_velocities_ [private] |
Definition at line 100 of file joint_state_decumulator.cpp.
Definition at line 88 of file joint_state_decumulator.cpp.
double JointStateDecumulator::publish_rate_ [private] |
Definition at line 93 of file joint_state_decumulator.cpp.
Definition at line 94 of file joint_state_decumulator.cpp.
Definition at line 90 of file joint_state_decumulator.cpp.
Definition at line 87 of file joint_state_decumulator.cpp.
std::map<std::string, bool> JointStateDecumulator::ungrouped_joints_ [private] |
Definition at line 101 of file joint_state_decumulator.cpp.