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

Public Member Functions

 PointsConcatFilter ()
 

Private Types

typedef sensor_msgs::PointCloud2 PointCloudMsgT
 
typedef pcl::PointCloud< PointTPointCloudT
 
typedef pcl::PointXYZI PointT
 
typedef message_filters::sync_policies::ApproximateTime< PointCloudMsgT, PointCloudMsgT, PointCloudMsgT, PointCloudMsgT, PointCloudMsgT, PointCloudMsgT, PointCloudMsgT, PointCloudMsgTSyncPolicyT
 

Private Member Functions

void pointcloud_callback (const PointCloudMsgT::ConstPtr &msg1, const PointCloudMsgT::ConstPtr &msg2, const PointCloudMsgT::ConstPtr &msg3, const PointCloudMsgT::ConstPtr &msg4, const PointCloudMsgT::ConstPtr &msg5, const PointCloudMsgT::ConstPtr &msg6, const PointCloudMsgT::ConstPtr &msg7, const PointCloudMsgT::ConstPtr &msg8)
 

Private Attributes

ros::Publisher cloud_publisher_
 
message_filters::Subscriber< PointCloudMsgT > * cloud_subscribers_ [8]
 
message_filters::Synchronizer< SyncPolicyT > * cloud_synchronizer_
 
ros::Subscriber config_subscriber_
 
std::string input_topics_
 
size_t input_topics_size_
 
ros::NodeHandle node_handle_
 
std::string output_frame_id_
 
ros::NodeHandle private_node_handle_
 
tf::TransformListener tf_listener_
 

Detailed Description

Definition at line 31 of file points_concat_filter.cpp.

Member Typedef Documentation

◆ PointCloudMsgT

typedef sensor_msgs::PointCloud2 PointsConcatFilter::PointCloudMsgT
private

Definition at line 39 of file points_concat_filter.cpp.

◆ PointCloudT

Definition at line 38 of file points_concat_filter.cpp.

◆ PointT

typedef pcl::PointXYZI PointsConcatFilter::PointT
private

Definition at line 37 of file points_concat_filter.cpp.

◆ SyncPolicyT

Definition at line 43 of file points_concat_filter.cpp.

Constructor & Destructor Documentation

◆ PointsConcatFilter()

PointsConcatFilter::PointsConcatFilter ( )

Definition at line 62 of file points_concat_filter.cpp.

Member Function Documentation

◆ pointcloud_callback()

void PointsConcatFilter::pointcloud_callback ( const PointCloudMsgT::ConstPtr &  msg1,
const PointCloudMsgT::ConstPtr &  msg2,
const PointCloudMsgT::ConstPtr &  msg3,
const PointCloudMsgT::ConstPtr &  msg4,
const PointCloudMsgT::ConstPtr &  msg5,
const PointCloudMsgT::ConstPtr &  msg6,
const PointCloudMsgT::ConstPtr &  msg7,
const PointCloudMsgT::ConstPtr &  msg8 
)
private

Definition at line 95 of file points_concat_filter.cpp.

Member Data Documentation

◆ cloud_publisher_

ros::Publisher PointsConcatFilter::cloud_publisher_
private

Definition at line 49 of file points_concat_filter.cpp.

◆ cloud_subscribers_

message_filters::Subscriber<PointCloudMsgT>* PointsConcatFilter::cloud_subscribers_[8]
private

Definition at line 46 of file points_concat_filter.cpp.

◆ cloud_synchronizer_

message_filters::Synchronizer<SyncPolicyT>* PointsConcatFilter::cloud_synchronizer_
private

Definition at line 47 of file points_concat_filter.cpp.

◆ config_subscriber_

ros::Subscriber PointsConcatFilter::config_subscriber_
private

Definition at line 48 of file points_concat_filter.cpp.

◆ input_topics_

std::string PointsConcatFilter::input_topics_
private

Definition at line 53 of file points_concat_filter.cpp.

◆ input_topics_size_

size_t PointsConcatFilter::input_topics_size_
private

Definition at line 52 of file points_concat_filter.cpp.

◆ node_handle_

ros::NodeHandle PointsConcatFilter::node_handle_
private

Definition at line 45 of file points_concat_filter.cpp.

◆ output_frame_id_

std::string PointsConcatFilter::output_frame_id_
private

Definition at line 54 of file points_concat_filter.cpp.

◆ private_node_handle_

ros::NodeHandle PointsConcatFilter::private_node_handle_
private

Definition at line 45 of file points_concat_filter.cpp.

◆ tf_listener_

tf::TransformListener PointsConcatFilter::tf_listener_
private

Definition at line 50 of file points_concat_filter.cpp.


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


points_preprocessor
Author(s): n-patiphon , aohsato
autogenerated on Mon Feb 28 2022 22:12:01