Public Member Functions | Private Member Functions | Private Attributes | List of all members
TexturingNode Class Reference

Public Member Functions

 TexturingNode ()
 

Private Member Functions

void onImageReceived (sensor_msgs::ImageConstPtr const &image)
 
void onPointCloudReceived (PointCloud::ConstPtr const &pointCloud)
 
void texture () const
 

Private Attributes

image_transport::Subscriber imageSubscriber
 
sensor_msgs::ImageConstPtr latestImage
 
PointCloud::ConstPtr latestPointCloud
 
std::mutex mutex
 
ros::NodeHandle nodeHandle
 
ros::Subscriber pointCloudSubscriber
 
ros::Publisher texturedPointCloudPublisher
 

Detailed Description

Definition at line 70 of file texture_point_cloud.cpp.

Constructor & Destructor Documentation

TexturingNode::TexturingNode ( )
inline

Definition at line 85 of file texture_point_cloud.cpp.

Member Function Documentation

void TexturingNode::onImageReceived ( sensor_msgs::ImageConstPtr const &  image)
inlineprivate

Definition at line 96 of file texture_point_cloud.cpp.

void TexturingNode::onPointCloudReceived ( PointCloud::ConstPtr const &  pointCloud)
inlineprivate

Definition at line 103 of file texture_point_cloud.cpp.

void TexturingNode::texture ( ) const
inlineprivate

Definition at line 111 of file texture_point_cloud.cpp.

Member Data Documentation

image_transport::Subscriber TexturingNode::imageSubscriber
private

Definition at line 77 of file texture_point_cloud.cpp.

sensor_msgs::ImageConstPtr TexturingNode::latestImage
private

Definition at line 81 of file texture_point_cloud.cpp.

PointCloud::ConstPtr TexturingNode::latestPointCloud
private

Definition at line 82 of file texture_point_cloud.cpp.

std::mutex TexturingNode::mutex
private

Definition at line 75 of file texture_point_cloud.cpp.

ros::NodeHandle TexturingNode::nodeHandle
private

Definition at line 73 of file texture_point_cloud.cpp.

ros::Subscriber TexturingNode::pointCloudSubscriber
private

Definition at line 78 of file texture_point_cloud.cpp.

ros::Publisher TexturingNode::texturedPointCloudPublisher
private

Definition at line 79 of file texture_point_cloud.cpp.


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


ensenso_camera
Author(s): Ensenso
autogenerated on Thu May 6 2021 02:50:06