Public Member Functions | Private Types | Private Attributes | List of all members
joint_states_settler::JointStatesSettler Class Reference

#include <joint_states_settler.h>

Public Member Functions

calibration_msgs::Interval add (const sensor_msgs::JointStateConstPtr msg)
 
bool configure (const joint_states_settler::ConfigGoal &goal)
 
 JointStatesSettler ()
 
sensor_msgs::JointState pruneJointState (const sensor_msgs::JointStateConstPtr msg)
 

Private Types

typedef settlerlib::SortedDeque< settlerlib::DeflatedConstPtrDeflatedCache
 
typedef settlerlib::SortedDeque< boost::shared_ptr< const DeflatedJointStates > > DeflatedMsgCache
 

Private Attributes

DeflatedMsgCache cache_
 
bool configured_
 
JointStatesDeflater deflater_
 
ros::Duration max_step_
 
std::vector< double > tol_
 

Detailed Description

Definition at line 87 of file joint_states_settler.h.

Member Typedef Documentation

◆ DeflatedCache

Definition at line 136 of file joint_states_settler.h.

◆ DeflatedMsgCache

Definition at line 135 of file joint_states_settler.h.

Constructor & Destructor Documentation

◆ JointStatesSettler()

JointStatesSettler::JointStatesSettler ( )

Definition at line 44 of file joint_states_settler.cpp.

Member Function Documentation

◆ add()

calibration_msgs::Interval JointStatesSettler::add ( const sensor_msgs::JointStateConstPtr  msg)

Definition at line 76 of file joint_states_settler.cpp.

◆ configure()

bool JointStatesSettler::configure ( const joint_states_settler::ConfigGoal &  goal)

Definition at line 49 of file joint_states_settler.cpp.

◆ pruneJointState()

sensor_msgs::JointState JointStatesSettler::pruneJointState ( const sensor_msgs::JointStateConstPtr  msg)

Definition at line 95 of file joint_states_settler.cpp.

Member Data Documentation

◆ cache_

DeflatedMsgCache joint_states_settler::JointStatesSettler::cache_
private

Definition at line 137 of file joint_states_settler.h.

◆ configured_

bool joint_states_settler::JointStatesSettler::configured_
private

Definition at line 130 of file joint_states_settler.h.

◆ deflater_

JointStatesDeflater joint_states_settler::JointStatesSettler::deflater_
private

Definition at line 131 of file joint_states_settler.h.

◆ max_step_

ros::Duration joint_states_settler::JointStatesSettler::max_step_
private

Definition at line 133 of file joint_states_settler.h.

◆ tol_

std::vector<double> joint_states_settler::JointStatesSettler::tol_
private

Definition at line 132 of file joint_states_settler.h.


The documentation for this class was generated from the following files:


joint_states_settler
Author(s): Vijay Pradeep, Eitan Marder-Eppstein
autogenerated on Tue Mar 1 2022 23:58:53