Go to the documentation of this file.
35 #ifndef JOINT_STATES_SETTLER_JOINT_STATES_DEFLATER_H_
36 #define JOINT_STATES_SETTLER_JOINT_STATES_DEFLATER_H_
38 #include <sensor_msgs/JointState.h>
52 class JointStatesDeflater
69 void deflate(
const sensor_msgs::JointStateConstPtr& joint_states, DeflatedJointStates& deflated_elem);
76 void prune(
const sensor_msgs::JointState& joint_states, sensor_msgs::JointState& pruned_joint_states);
86 void updateMapping(
const sensor_msgs::JointState& joint_states);
std::vector< std::string > joint_names_
void updateMapping(const sensor_msgs::JointState &joint_states)
Given a stereotypical JointStates message, computes the mapping from JointStates to the deflated data...
std::vector< unsigned int > mapping_
void setDeflationJointNames(std::vector< std::string > joint_names)
Specify which joints to extract.
void deflate(const sensor_msgs::JointStateConstPtr &joint_states, DeflatedJointStates &deflated_elem)
Perform the deflation on a joint_states message.
void prune(const sensor_msgs::JointState &joint_states, sensor_msgs::JointState &pruned_joint_states)
Remove all the joints that we don't care about.
joint_states_settler
Author(s): Vijay Pradeep, Eitan Marder-Eppstein
autogenerated on Tue Mar 1 2022 23:58:53