Public Member Functions | Private Member Functions | Private Attributes | List of all members
rslidar_pointcloud::Convert Class Reference

#include <convert.h>

Public Member Functions

 Convert (ros::NodeHandle node, ros::NodeHandle private_nh)
 Constructor. More...
 
 ~Convert ()
 

Private Member Functions

void callback (rslidar_pointcloud::CloudNodeConfig &config, uint32_t level)
 
void processScan (const rslidar_msgs::rslidarScan::ConstPtr &scanMsg)
 Callback for raw scan messages. More...
 

Private Attributes

boost::shared_ptr< rslidar_rawdata::RawDatadata_
 
ros::Publisher output_
 
ros::Subscriber rslidar_scan_
 
boost::shared_ptr< dynamic_reconfigure::Server< rslidar_pointcloud::CloudNodeConfig > > srv_
 Pointer to dynamic reconfigure service srv_. More...
 

Detailed Description

Definition at line 63 of file convert.h.

Constructor & Destructor Documentation

rslidar_pointcloud::Convert::Convert ( ros::NodeHandle  node,
ros::NodeHandle  private_nh 
)

Constructor.

Definition at line 60 of file convert.cc.

rslidar_pointcloud::Convert::~Convert ( )
inline

Definition at line 68 of file convert.h.

Member Function Documentation

void rslidar_pointcloud::Convert::callback ( rslidar_pointcloud::CloudNodeConfig &  config,
uint32_t  level 
)
private

Definition at line 78 of file convert.cc.

void rslidar_pointcloud::Convert::processScan ( const rslidar_msgs::rslidarScan::ConstPtr &  scanMsg)
private

Callback for raw scan messages.

Definition at line 85 of file convert.cc.

Member Data Documentation

boost::shared_ptr<rslidar_rawdata::RawData> rslidar_pointcloud::Convert::data_
private

Definition at line 80 of file convert.h.

ros::Publisher rslidar_pointcloud::Convert::output_
private

Definition at line 82 of file convert.h.

ros::Subscriber rslidar_pointcloud::Convert::rslidar_scan_
private

Definition at line 81 of file convert.h.

boost::shared_ptr<dynamic_reconfigure::Server<rslidar_pointcloud::CloudNodeConfig> > rslidar_pointcloud::Convert::srv_
private

Pointer to dynamic reconfigure service srv_.

Definition at line 78 of file convert.h.


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


rslidar_pointcloud
Author(s): Tony Zhang , Tony Zhang, George Wang, Piyush Khandelwal, Jesse Vera
autogenerated on Mon Jun 10 2019 14:41:10