|
Swarm-SLAM
1.0.0
C-SLAM Framework
|
#include "cslam/front_end/visualization_utils.h"Go to the source code of this file.
Namespaces | |
| cslam | |
Functions | |
| sensor_msgs::msg::PointCloud2 | cslam::create_colored_pointcloud (const std::shared_ptr< rtabmap::SensorData > &sensor_data, const std_msgs::msg::Header &header) |
| Create a colored pointcloud message. More... | |
| template<typename T > | |
| void | cslam::depth_image_to_pointcloud (const std::shared_ptr< rtabmap::SensorData > &sensor_data, sensor_msgs::msg::PointCloud2::SharedPtr &cloud_msg, const image_geometry::PinholeCameraModel &model, double range_max=0.0) |
| Convert depth image to pointcloud. More... | |
| void | cslam::add_rgb_to_pointcloud (const std::shared_ptr< rtabmap::SensorData > &sensor_data, sensor_msgs::msg::PointCloud2::SharedPtr &cloud_msg) |
| Add color to pointcloud. More... | |