35 #ifndef JOINT_STATES_SETTLER_JOINT_STATES_DEFLATER_H_ 36 #define JOINT_STATES_SETTLER_JOINT_STATES_DEFLATER_H_ 38 #include <sensor_msgs/JointState.h> 76 void prune(
const sensor_msgs::JointState& joint_states, sensor_msgs::JointState& pruned_joint_states);
86 void updateMapping(
const sensor_msgs::JointState& joint_states);
void prune(const sensor_msgs::JointState &joint_states, sensor_msgs::JointState &pruned_joint_states)
Remove all the joints that we don't care about.
std::vector< unsigned int > mapping_
void updateMapping(const sensor_msgs::JointState &joint_states)
Given a stereotypical JointStates message, computes the mapping from JointStates to the deflated data...
void deflate(const sensor_msgs::JointStateConstPtr &joint_states, DeflatedJointStates &deflated_elem)
Perform the deflation on a joint_states message.
std::vector< std::string > joint_names_
void setDeflationJointNames(std::vector< std::string > joint_names)
Specify which joints to extract.
Given a set a joint names, efficiently extracts a subset of joint positions.