Public Member Functions | Private Member Functions | Private Attributes
laser_joint_processor::LaserJointProcessorNode Class Reference

#include <laser_joint_processor_node.h>

List of all members.

Public Member Functions

void configure (const std::vector< std::string > &joint_names, unsigned max_cache_size)
void jointStateCallback (const sensor_msgs::JointStateConstPtr &joint_state)
 LaserJointProcessorNode ()
 ~LaserJointProcessorNode ()

Private Member Functions

void processPair (const calibration_msgs::DenseLaserSnapshotConstPtr &snapshot, const calibration_msgs::CalibrationPatternConstPtr &features)
void syncCallback (const calibration_msgs::DenseLaserSnapshotConstPtr &snapshot, const calibration_msgs::CalibrationPatternConstPtr &features)

Private Attributes

message_filters::Subscriber
< calibration_msgs::CalibrationPattern > 
features_sub_
boost::mutex mutex_
ros::NodeHandle nh_
LaserJointProcessor processor_
ros::Publisher pub_
calibration_msgs::CalibrationPatternConstPtr queued_features_
calibration_msgs::DenseLaserSnapshotConstPtr queued_snapshot_
message_filters::Subscriber
< calibration_msgs::DenseLaserSnapshot > 
snapshot_sub_
message_filters::TimeSynchronizer
< calibration_msgs::DenseLaserSnapshot,
calibration_msgs::CalibrationPattern > 
sync_
message_filters::Connection sync_connection_

Detailed Description

Definition at line 44 of file laser_joint_processor_node.h.


Constructor & Destructor Documentation

Definition at line 46 of file laser_joint_processor_node.cpp.

Definition at line 57 of file laser_joint_processor_node.cpp.


Member Function Documentation

void LaserJointProcessorNode::configure ( const std::vector< std::string > &  joint_names,
unsigned  max_cache_size 
)

Definition at line 62 of file laser_joint_processor_node.cpp.

void LaserJointProcessorNode::jointStateCallback ( const sensor_msgs::JointStateConstPtr &  joint_state)

Definition at line 102 of file laser_joint_processor_node.cpp.

void LaserJointProcessorNode::processPair ( const calibration_msgs::DenseLaserSnapshotConstPtr &  snapshot,
const calibration_msgs::CalibrationPatternConstPtr &  features 
) [private]

Definition at line 136 of file laser_joint_processor_node.cpp.

void LaserJointProcessorNode::syncCallback ( const calibration_msgs::DenseLaserSnapshotConstPtr &  snapshot,
const calibration_msgs::CalibrationPatternConstPtr &  features 
) [private]

Definition at line 68 of file laser_joint_processor_node.cpp.


Member Data Documentation

Definition at line 68 of file laser_joint_processor_node.h.

Definition at line 62 of file laser_joint_processor_node.h.

Definition at line 65 of file laser_joint_processor_node.h.

Definition at line 78 of file laser_joint_processor_node.h.

Definition at line 66 of file laser_joint_processor_node.h.

calibration_msgs::CalibrationPatternConstPtr laser_joint_processor::LaserJointProcessorNode::queued_features_ [private]

Definition at line 75 of file laser_joint_processor_node.h.

calibration_msgs::DenseLaserSnapshotConstPtr laser_joint_processor::LaserJointProcessorNode::queued_snapshot_ [private]

Definition at line 74 of file laser_joint_processor_node.h.

Definition at line 67 of file laser_joint_processor_node.h.

message_filters::TimeSynchronizer<calibration_msgs::DenseLaserSnapshot, calibration_msgs::CalibrationPattern> laser_joint_processor::LaserJointProcessorNode::sync_ [private]

Definition at line 70 of file laser_joint_processor_node.h.

Definition at line 71 of file laser_joint_processor_node.h.


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


laser_joint_processor
Author(s): Vijay Pradeep
autogenerated on Fri Aug 28 2015 12:06:26