Public Member Functions | |
JointStateAccumulator () | |
void | jointStateCallback (const sensor_msgs::JointStateConstPtr &jointState) |
void | publishAccumlatedJointState () |
Private Attributes | |
std::map< std::string, unsigned int > | joint_indices_ |
ros::Publisher | joint_state_publisher_ |
ros::Subscriber | joint_state_subscriber_ |
std::map< std::string, double > | joint_values_ |
std::map< std::string, double > | joint_velocities_ |
planning_environment::RobotModels * | robot_model_ |
ros::NodeHandle | root_handle_ |
Definition at line 7 of file joint_state_accumulator.cpp.
JointStateAccumulator::JointStateAccumulator | ( | ) | [inline] |
Definition at line 11 of file joint_state_accumulator.cpp.
void JointStateAccumulator::jointStateCallback | ( | const sensor_msgs::JointStateConstPtr & | jointState | ) | [inline] |
Definition at line 32 of file joint_state_accumulator.cpp.
void JointStateAccumulator::publishAccumlatedJointState | ( | ) | [inline] |
Definition at line 45 of file joint_state_accumulator.cpp.
std::map<std::string, unsigned int> JointStateAccumulator::joint_indices_ [private] |
Definition at line 70 of file joint_state_accumulator.cpp.
Definition at line 67 of file joint_state_accumulator.cpp.
Definition at line 68 of file joint_state_accumulator.cpp.
std::map<std::string, double> JointStateAccumulator::joint_values_ [private] |
Definition at line 71 of file joint_state_accumulator.cpp.
std::map<std::string, double> JointStateAccumulator::joint_velocities_ [private] |
Definition at line 72 of file joint_state_accumulator.cpp.
Definition at line 65 of file joint_state_accumulator.cpp.
Definition at line 64 of file joint_state_accumulator.cpp.