

Go to the source code of this file.
Macros | |
| #define | __SICK_ROS_SIMU_POINTCLOUD_UTILS_H_INCLUDED |
| #define | ROSSIMU_DEMO_FOLDER "./demo" |
Functions | |
| void | plotPointCloud (const ros_sensor_msgs::PointCloud2 &cloud_, int intervall=25, const std::string &outputfolder=ROSSIMU_DEMO_FOLDER) |
| void | setVisualizationMarkerArray (const std::vector< ros_visualization_msgs::Marker > &marker_array) |
| #define __SICK_ROS_SIMU_POINTCLOUD_UTILS_H_INCLUDED |
Definition at line 62 of file pointcloud_utils.h.
| #define ROSSIMU_DEMO_FOLDER "./demo" |
Definition at line 69 of file pointcloud_utils.h.
| void plotPointCloud | ( | const ros_sensor_msgs::PointCloud2 & | cloud_, |
| int | intervall = 25, |
||
| const std::string & | outputfolder = ROSSIMU_DEMO_FOLDER |
||
| ) |
Definition at line 237 of file pointcloud_utils.cpp.
| void setVisualizationMarkerArray | ( | const std::vector< ros_visualization_msgs::Marker > & | marker_array | ) |
Definition at line 173 of file pointcloud_utils.cpp.