Public Member Functions | Private Types | Private Member Functions | Private Attributes
scan_tools::ScanToCloudConverter Class Reference

#include <scan_to_cloud_converter.h>

List of all members.

Public Member Functions

 ScanToCloudConverter (ros::NodeHandle nh, ros::NodeHandle nh_private)
 ~ScanToCloudConverter ()

Private Types

typedef pcl::PointCloud< PointTPointCloudT
typedef pcl::PointXYZ PointT

Private Member Functions

void scanCallback (const sensor_msgs::LaserScan::ConstPtr &scan_msg)

Private Attributes

ros::Publisher cloud_publisher_
PointT invalid_point_
ros::NodeHandle nh_
ros::NodeHandle nh_private_
ros::Subscriber scan_subscriber_

Detailed Description

Definition at line 42 of file scan_to_cloud_converter.h.


Member Typedef Documentation

Definition at line 45 of file scan_to_cloud_converter.h.

typedef pcl::PointXYZ scan_tools::ScanToCloudConverter::PointT [private]

Definition at line 44 of file scan_to_cloud_converter.h.


Constructor & Destructor Documentation

Definition at line 36 of file scan_to_cloud_converter.cpp.

Definition at line 52 of file scan_to_cloud_converter.cpp.


Member Function Documentation

void scan_tools::ScanToCloudConverter::scanCallback ( const sensor_msgs::LaserScan::ConstPtr &  scan_msg) [private]

Definition at line 57 of file scan_to_cloud_converter.cpp.


Member Data Documentation

Definition at line 52 of file scan_to_cloud_converter.h.

Definition at line 55 of file scan_to_cloud_converter.h.

Definition at line 49 of file scan_to_cloud_converter.h.

Definition at line 50 of file scan_to_cloud_converter.h.

Definition at line 53 of file scan_to_cloud_converter.h.


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


scan_to_cloud_converter
Author(s): Ivan Dryanovski, William Morris
autogenerated on Thu Mar 23 2017 03:34:40