This package converts ROS sensor_msgs::Range to sensor_msgs::PointCloud2 for whatever reason.
cd ~ && mkdir -p ros_ws/src && cd ~/ros_ws/src
git clone https://github.com/mpheng666/ros-range-to-pointcloud.git
cd ~/ros_ws && catkin build
orcd ~/ros_ws && catkin_make
cd ~/ros_ws && source ~/ros_ws/devel/setup.bash
- Edit the params in config/param.yaml
- Edit the tf.launch in launch/tf.launch
-
If tf is defined in URDF or launch somewhere else
roslaunch range_to_pointcloud start.launch use_tf:=false
-
If tf is defined in launch/tf.launch
roslaunch range_to_pointcloud start.launch use_tf:=true
-
run
rviz
to visualize it