Public Member Functions | Private Attributes | List of all members
laser_joint_projector::LaserJointProjector Class Reference

#include <laser_joint_projector.h>

Public Member Functions

void configure (const KDL::Tree &tree, const std::string &root, const std::string &tip)
 
 LaserJointProjector ()
 
geometry_msgs::Point32 project (const std::map< std::string, double > &joint_map)
 
sensor_msgs::PointCloud project (const std::vector< sensor_msgs::JointState > &joint_state_vec, const ros::Duration &time_shift)
 

Private Attributes

KDL::Chain chain_
 
boost::shared_ptr< KDL::ChainFkSolverPos_recursivesolver_
 

Detailed Description

Definition at line 52 of file laser_joint_projector.h.

Constructor & Destructor Documentation

LaserJointProjector::LaserJointProjector ( )

Definition at line 45 of file laser_joint_projector.cpp.

Member Function Documentation

void LaserJointProjector::configure ( const KDL::Tree tree,
const std::string &  root,
const std::string &  tip 
)

Definition at line 50 of file laser_joint_projector.cpp.

geometry_msgs::Point32 laser_joint_projector::LaserJointProjector::project ( const std::map< std::string, double > &  joint_map)
sensor_msgs::PointCloud laser_joint_projector::LaserJointProjector::project ( const std::vector< sensor_msgs::JointState > &  joint_state_vec,
const ros::Duration time_shift 
)

Member Data Documentation

KDL::Chain laser_joint_projector::LaserJointProjector::chain_
private

Definition at line 61 of file laser_joint_projector.h.

boost::shared_ptr<KDL::ChainFkSolverPos_recursive> laser_joint_projector::LaserJointProjector::solver_
private

Definition at line 62 of file laser_joint_projector.h.


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


laser_joint_projector
Author(s): Vijay Pradeep
autogenerated on Tue Jun 1 2021 02:50:56