You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
The maximum intensity in a sensor_msgs::LaserScan coming from stage_ros is clipped to 256. The behavior comes from line 460 in stage_ros.cpp msg.intensities[i] = (uint8_t)sensor.intensities[i];
By casting to a uint8_t it clips the maximum return of a ranger in stage to 256
Intensities can require more than 8 bits. Stage stores intensity values as doubles internally. On the output side the sensor_msgs::LaserScan message stores intensities as 32 bit floats. In reality the Hokuyo UTM-30LX returns 18 bit intensity values.
The text was updated successfully, but these errors were encountered:
sloretz
added a commit
to sloretz/stage_ros
that referenced
this issue
Dec 30, 2015
The maximum intensity in a sensor_msgs::LaserScan coming from stage_ros is clipped to 256. The behavior comes from line 460 in stage_ros.cpp
msg.intensities[i] = (uint8_t)sensor.intensities[i];
By casting to a uint8_t it clips the maximum return of a ranger in stage to 256
Intensities can require more than 8 bits. Stage stores intensity values as doubles internally. On the output side the sensor_msgs::LaserScan message stores intensities as 32 bit floats. In reality the Hokuyo UTM-30LX returns 18 bit intensity values.
The text was updated successfully, but these errors were encountered: