但是livox_laser_simulation发布的点云格式为sensor_msgs::PointCloud,并不是按照Livox的驱动格式livox_ros_driver::CustomMsg发布的,这就导致我没有办法用fast-lio来做定位导航。 所以我的问题是:目前的livox_laser_simulation是否本就可以发布livox_ros_driver::CustomMsg格式的点云;另外,如果目前的模拟器不能发布...
fatal error: livox_ros_driver/CustomMsg.h: No such file or directory #include <livox_ros_driver/CustomMsg.h> 缺少这个头文件是什么情况,在原程序包中也没找到这个livox_ros_driver/CustomMsg.h头文件,这个怎么解决?saganluk commented Jun 21, 2022 你解决了这个问题没 flashlau commented Oct 27, 2...
ros::NodeHandle nh;ROS_INFO("---发布PointXYZI格式---"); ros::Subscriber sub_livox_msg1 = nh.subscribe<livox_ros_driver::CustomMsg>("/livox/lidar",10,LivoxMsgcbk1); pub_pcl_out1 = nh.advertise<sensor_msgs::PointCloud2>("/velodyne_points",10); ros::Subscriber sub_laser_map = nh...
0.1s (10HZ) 浩界点云扫描示意图 在浩界 Horizon的点云数据中,每个点所属的线号、时间戳等信息都可轻松读取,以本文使用的 livox_ros_driver/CustomMsg 数据格式为例,其数据结构如下所示: 图1 custom message 数据格式 对于第 n 线(即line=n)的一个点 通过与其同线号的邻近点,可以计算该点的曲率值。基于...
需要安装Livox-SDK2和livox_ros_driver2,经测试发现在catkin_ws/src目录下无法正常安装,会报fatal error: livox_ros_driver/CustomMsg.h:No such file and directory错误,怀疑是多线程编译导致,因此选择在其他目录下安装这两个包。 cd ~ mkdir livox_ws/src ...
roslaunch livox_ros_driver livox_lidar_rviz.launch 需要livox 的 点云消息格式是customMsg,可以通过下面的指令检查下 rostopic info /livox/lidar 同时需要检查下标定板是否在照片中,使用如下指令: rqt_image_view 下面让无人机飞起来,大致在朝向标顶板的中心 ...
但是经过测试发现 livox_laser_simulation 雷达仿真功能包发布的是 ros PointCloud2 点云格式数据。 而现在针对livox雷达的激光slam算法用的是 livox CustomMsg 点云格式数据,例如 Fast-Lio2 、Faster-Lio 、Lio-livox等。所以想在gazebo中仿真这些算法,需要将 ros PointCloud2格式数据转为livox CustomMsg格式 。
if (Lidar_Type == 0) { customCloud = nodeHandler.subscribe<livox_ros_driver::CustomMsg>("/livox/lidar", 100, &lidarCallBackHorizon); } else if (Lidar_Type == 1) { customCloud = nodeHandler.subscribe<livox_ros_driver::CustomMsg>("/livox/lidar", 100, &lidarCallBackHAP); } else ...
livox_ros_driver::CustomMsg::ConstPtr &msg,PointCloudXYZI::Ptr&pcl_out) { avia_handler(msg...
roslaunch livox_ros_driver livox_lidar_rviz.launch 需要livox 的 点云消息格式是customMsg,可以通过下面的指令检查下 rostopic info /livox/lidar 同时需要检查下标定板是否在照片中,使用如下指令: rqt_image_view 下面让无人机飞起来,大致在...