#include <range_to_cloud.h>
Public Member Functions | |
RangeToCloud (ros::NodeHandle node, ros::NodeHandle priv_nh) | |
Constructor. | |
~RangeToCloud () | |
Private Member Functions | |
void | processRange (const sensor_msgs::Range::ConstPtr &rangeMsg) |
Private Attributes | |
tf::TransformListener | listener_ |
ros::Publisher | points_ |
ros::Subscriber | ranges_ |
Definition at line 51 of file range_to_cloud.h.
segbot_sensors::RangeToCloud::RangeToCloud | ( | ros::NodeHandle | node, |
ros::NodeHandle | priv_nh | ||
) |
Constructor.
Definition at line 60 of file range_to_cloud.cpp.
segbot_sensors::RangeToCloud::~RangeToCloud | ( | ) | [inline] |
Definition at line 55 of file range_to_cloud.h.
void segbot_sensors::RangeToCloud::processRange | ( | const sensor_msgs::Range::ConstPtr & | rangeMsg | ) | [private] |
Definition at line 74 of file range_to_cloud.cpp.
Definition at line 62 of file range_to_cloud.h.
Definition at line 61 of file range_to_cloud.h.
Definition at line 60 of file range_to_cloud.h.