cloud.cc File Reference
#include <ros/ros.h>
#include <sensor_msgs/PointCloud.h>
#include <velodyne/data.h>
Go to the source code of this file.
Detailed Description
This ROS node converts raw Velodyne HDL-64E 3D LIDAR data to a PointCloud.
Definition in file cloud.cc.
Define Documentation
#define NODE "velodyne_cloud" |
Function Documentation
int getParameters |
( |
int |
argc, |
|
|
char * |
argv[] | |
|
) |
| | |
get command line and ROS parameters
- Returns:
- 0 if successful
Definition at line 82 of file cloud.cc.
int main |
( |
int |
argc, |
|
|
char * |
argv[] | |
|
) |
| | |
callback for XYZ points
publishes Velodyne data points as a point cloud
Definition at line 39 of file cloud.cc.
Variable Documentation
ros::Publisher output [static] |
sensor_msgs::PointCloud pc |