Public Member Functions | Private Member Functions | Private Attributes
pointcloud_to_laserscan::PointCloudToLaserScanNodelet Class Reference

#include <pointcloud_to_laserscan_nodelet.h>

Inheritance diagram for pointcloud_to_laserscan::PointCloudToLaserScanNodelet:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 PointCloudToLaserScanNodelet ()

Private Member Functions

void cloudCb (const sensor_msgs::PointCloud2ConstPtr &cloud_msg)
void connectCb ()
void disconnectCb ()
void failureCb (const sensor_msgs::PointCloud2ConstPtr &cloud_msg, tf2_ros::filter_failure_reasons::FilterFailureReason reason)
virtual void onInit ()

Private Attributes

double angle_increment_
double angle_max_
double angle_min_
boost::mutex connect_mutex_
unsigned int input_queue_size_
double max_height_
boost::shared_ptr< MessageFiltermessage_filter_
double min_height_
ros::NodeHandle nh_
ros::NodeHandle private_nh_
ros::Publisher pub_
double range_max_
double range_min_
double scan_time_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
sub_
std::string target_frame_
boost::shared_ptr
< tf2_ros::Buffer
tf2_
boost::shared_ptr
< tf2_ros::TransformListener
tf2_listener_
double tolerance_
bool use_inf_

Detailed Description

Class to process incoming pointclouds into laserscans. Some initial code was pulled from the defunct turtlebot pointcloud_to_laserscan implementation.

Definition at line 62 of file pointcloud_to_laserscan_nodelet.h.


Constructor & Destructor Documentation

Definition at line 50 of file pointcloud_to_laserscan_nodelet.cpp.


Member Function Documentation

void pointcloud_to_laserscan::PointCloudToLaserScanNodelet::cloudCb ( const sensor_msgs::PointCloud2ConstPtr &  cloud_msg) [private]

Definition at line 139 of file pointcloud_to_laserscan_nodelet.cpp.

Definition at line 112 of file pointcloud_to_laserscan_nodelet.cpp.

Definition at line 122 of file pointcloud_to_laserscan_nodelet.cpp.

void pointcloud_to_laserscan::PointCloudToLaserScanNodelet::failureCb ( const sensor_msgs::PointCloud2ConstPtr &  cloud_msg,
tf2_ros::filter_failure_reasons::FilterFailureReason  reason 
) [private]

Definition at line 132 of file pointcloud_to_laserscan_nodelet.cpp.

Implements nodelet::Nodelet.

Definition at line 52 of file pointcloud_to_laserscan_nodelet.cpp.


Member Data Documentation

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 81 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 89 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 86 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Reimplemented from nodelet::Nodelet.

Definition at line 79 of file pointcloud_to_laserscan_nodelet.h.

Reimplemented from nodelet::Nodelet.

Definition at line 79 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 80 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 92 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 85 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 90 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 83 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 84 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 91 of file pointcloud_to_laserscan_nodelet.h.

Definition at line 93 of file pointcloud_to_laserscan_nodelet.h.


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


pointcloud_to_laserscan
Author(s): Paul Bovbel , Tully Foote
autogenerated on Thu Apr 27 2017 02:34:33