37 #ifndef JOINT_STATES_SETTLER_JOINT_STATES_SETTLER_H_ 38 #define JOINT_STATES_SETTLER_JOINT_STATES_SETTLER_H_ 40 #include <boost/shared_ptr.hpp> 42 #include <calibration_msgs/Interval.h> 43 #include <sensor_msgs/JointState.h> 47 #include <joint_states_settler/ConfigGoal.h> 60 bool configure(
const joint_states_settler::ConfigGoal& goal);
62 calibration_msgs::Interval
add(
const sensor_msgs::JointStateConstPtr msg);
63 sensor_msgs::JointState
pruneJointState(
const sensor_msgs::JointStateConstPtr msg);
settlerlib::SortedDeque< boost::shared_ptr< const DeflatedJointStates > > DeflatedMsgCache
bool configure(const joint_states_settler::ConfigGoal &goal)
calibration_msgs::Interval add(const sensor_msgs::JointStateConstPtr msg)
sensor_msgs::JointState pruneJointState(const sensor_msgs::JointStateConstPtr msg)
std::vector< double > tol_
settlerlib::SortedDeque< settlerlib::DeflatedConstPtr > DeflatedCache
Given a set a joint names, efficiently extracts a subset of joint positions.
JointStatesDeflater deflater_