Public Member Functions | Private Member Functions | Private Attributes | List of all members
laser_proc::LaserProcROS Class Reference

#include <LaserProcROS.h>

Public Member Functions

 LaserProcROS (ros::NodeHandle &n, ros::NodeHandle &pnh)
 
 ~LaserProcROS ()
 

Private Member Functions

void connectCb (const ros::SingleSubscriberPublisher &pub)
 
void disconnectCb (const ros::SingleSubscriberPublisher &pub)
 
void scanCb (const sensor_msgs::MultiEchoLaserScanConstPtr &msg) const
 

Private Attributes

boost::mutex connect_mutex_
 Prevents the connectCb and disconnectCb from being called until everything is initialized. More...
 
ros::NodeHandle nh_
 Nodehandle used to subscribe in the connectCb. More...
 
laser_proc::LaserPublisher pub_
 Publisher. More...
 
ros::Subscriber sub_
 Multi echo subscriber. More...
 

Detailed Description

Definition at line 45 of file LaserProcROS.h.

Constructor & Destructor Documentation

LaserProcROS::LaserProcROS ( ros::NodeHandle n,
ros::NodeHandle pnh 
)

Definition at line 38 of file LaserProcROS.cpp.

LaserProcROS::~LaserProcROS ( )

Definition at line 45 of file LaserProcROS.cpp.

Member Function Documentation

void LaserProcROS::connectCb ( const ros::SingleSubscriberPublisher pub)
private

Callback that is called when there is a new subscriber.

Will not subscribe until we have a subscriber for our LaserScans (lazy subscribing).

Definition at line 55 of file LaserProcROS.cpp.

void LaserProcROS::disconnectCb ( const ros::SingleSubscriberPublisher pub)
private

Callback called when a subscriber unsubscribes.

If all current subscribers of our LaserScans stop listening, stop subscribing (lazy subscribing).

Definition at line 63 of file LaserProcROS.cpp.

void LaserProcROS::scanCb ( const sensor_msgs::MultiEchoLaserScanConstPtr &  msg) const
private

Definition at line 51 of file LaserProcROS.cpp.

Member Data Documentation

boost::mutex laser_proc::LaserProcROS::connect_mutex_
private

Prevents the connectCb and disconnectCb from being called until everything is initialized.

Definition at line 76 of file LaserProcROS.h.

ros::NodeHandle laser_proc::LaserProcROS::nh_
private

Nodehandle used to subscribe in the connectCb.

Definition at line 72 of file LaserProcROS.h.

laser_proc::LaserPublisher laser_proc::LaserProcROS::pub_
private

Publisher.

Definition at line 73 of file LaserProcROS.h.

ros::Subscriber laser_proc::LaserProcROS::sub_
private

Multi echo subscriber.

Definition at line 74 of file LaserProcROS.h.


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


laser_proc
Author(s): Chad Rockey
autogenerated on Mon Jun 10 2019 13:45:29