Public Member Functions | Private Member Functions | Private Attributes | List of all members
velodyne_laserscan::VelodyneLaserScan Class Reference

#include <velodyne_laserscan.h>

Public Member Functions

 VelodyneLaserScan (ros::NodeHandle &nh, ros::NodeHandle &nh_priv)
 

Private Member Functions

void connectCb ()
 
void reconfig (VelodyneLaserScanConfig &config, uint32_t level)
 
void recvCallback (const sensor_msgs::PointCloud2ConstPtr &msg)
 

Private Attributes

VelodyneLaserScanConfig cfg_
 
boost::mutex connect_mutex_
 
ros::NodeHandle nh_
 
ros::Publisher pub_
 
unsigned int ring_count_
 
dynamic_reconfigure::Server< VelodyneLaserScanConfig > srv_
 
ros::Subscriber sub_
 

Detailed Description

Definition at line 49 of file velodyne_laserscan.h.

Constructor & Destructor Documentation

velodyne_laserscan::VelodyneLaserScan::VelodyneLaserScan ( ros::NodeHandle nh,
ros::NodeHandle nh_priv 
)

Definition at line 39 of file velodyne_laserscan.cpp.

Member Function Documentation

void velodyne_laserscan::VelodyneLaserScan::connectCb ( )
private

Definition at line 48 of file velodyne_laserscan.cpp.

void velodyne_laserscan::VelodyneLaserScan::reconfig ( VelodyneLaserScanConfig &  config,
uint32_t  level 
)
private

Definition at line 272 of file velodyne_laserscan.cpp.

void velodyne_laserscan::VelodyneLaserScan::recvCallback ( const sensor_msgs::PointCloud2ConstPtr &  msg)
private

Definition at line 61 of file velodyne_laserscan.cpp.

Member Data Documentation

VelodyneLaserScanConfig velodyne_laserscan::VelodyneLaserScan::cfg_
private

Definition at line 63 of file velodyne_laserscan.h.

boost::mutex velodyne_laserscan::VelodyneLaserScan::connect_mutex_
private

Definition at line 55 of file velodyne_laserscan.h.

ros::NodeHandle velodyne_laserscan::VelodyneLaserScan::nh_
private

Definition at line 59 of file velodyne_laserscan.h.

ros::Publisher velodyne_laserscan::VelodyneLaserScan::pub_
private

Definition at line 61 of file velodyne_laserscan.h.

unsigned int velodyne_laserscan::VelodyneLaserScan::ring_count_
private

Definition at line 67 of file velodyne_laserscan.h.

dynamic_reconfigure::Server<VelodyneLaserScanConfig> velodyne_laserscan::VelodyneLaserScan::srv_
private

Definition at line 64 of file velodyne_laserscan.h.

ros::Subscriber velodyne_laserscan::VelodyneLaserScan::sub_
private

Definition at line 60 of file velodyne_laserscan.h.


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


velodyne_laserscan
Author(s): Micho Radovnikovich, Kevin Hallenbeck
autogenerated on Thu Jul 4 2019 19:09:25