Closed patrick-neal closed 3 years ago
This has hit us hard in our SubT solution with MARV robot!
STR:
roscore
rosrun ros_ign_bridge parameter_bridge /world/lidar_sensor/model/ctu_cras_norlab_marv_sensor_config_1/link/laser/sensor/laser/scan/points@sensor_msgs/PointCloud2[ignition.msgs.PointCloudPacked
Fix in #132.
I believe the clamping in #86 might be causing no return rays to display in Rviz2. Example of code: https://github.com/ignitionrobotics/ign-sensors/blob/bb16d12fde391e2e9655c7e74bff85193c00f119/src/Lidar.cc#L202-L220 Comment from existing code base: https://github.com/ignitionrobotics/ign-sensors/blob/bb16d12fde391e2e9655c7e74bff85193c00f119/src/GpuLidarSensor.cc#L186-L187 Visualization with noise Without noise.