We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent 25f377d commit efa7427Copy full SHA for efa7427
src/rviz/default_plugin/laser_scan_display.cpp
@@ -81,7 +81,7 @@ void LaserScanDisplay::processMessage(const sensor_msgs::LaserScanConstPtr& scan
81
{
82
auto tf = context_->getTF2BufferPtr();
83
84
- projector_->transformLaserScanToPointCloud(fixed_frame_.toStdString(), *scan, *cloud, *tf,
+ projector_->transformLaserScanToPointCloud(fixed_frame_.toStdString(), *scan, *cloud, *tf, -1.0,
85
laser_geometry::channel_option::Intensity);
86
}
87
catch (tf2::TransformException& e)
0 commit comments