Ros发布点云文件

ros如果要发布点云文件,需要把点云文件转换为ros的点云消息格式

sensor_msgs::PointCloud2

这个需要点云库文件

#include 
#include 
#include 
#include 

核心的代码是

ros::NodeHandle nh;
ros::Publisher pcl_pub = nh.advertise<sensor_msgs::PointCloud2>("/pcl_points",20);

// pcl::PointXYZ 是无颜色的点云文件时的格式,如果要发送有颜色的点云,可以换成 pcl::PointXYZRGB
pcl::PointCloud<pcl::PointXY> cloud;
 sensor_msgs::PointCloud2 output;
    
 pcl::io::loadPCDFile(files_1[i], cloud);
 pcl::toROSMsg(cloud,output);
 output.header.frame_id = "camera_init";  // 非常重要!!在 rviz 中接受消息时要把最上面的 Global Options 一栏中的 Fixed Frame 改为自己在代码中设置的 .header.frame_id,也就是 camera_init,否则无法显示
 pcl_pub.publish(output);

在CMakeList.txt文件中要添加点云库支持

find_package(PCL REQUIRED COMPONENTS io)
include_directories(
 
  ${catkin_INCLUDE_DIRS}
  ${PCL_IO_INCLUDE_DIRS}
)

 target_link_libraries(node ${catkin_LIBRARIES} ${PCL_IO_LIBRARIES})

你可能感兴趣的:(ROS,ROS,点云,ros消息)