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
I am trying to implement a range measurement plugin using the libgazebo_ros_ray_sensor, i defined the sensor as documented in the migration wiki: <sensor type="gpu_ray" name="range_sensor"> <visualize>True</visualize> <update_rate>30</update_rate> <ray> <scan> <horizontal> <samples>15</samples> <resolution>1</resolution> <min_angle>-0.087</min_angle> <max_angle>0.087</max_angle> </horizontal> <vertical> <samples>15</samples> <resolution>1</resolution> <min_angle>-0.087</min_angle> <max_angle>0.087</max_angle> </vertical> </scan> <range> <min>0.05</min> <max>15.0</max> <resolution>0.01</resolution> </range> <noise> <type>gaussian</type> <mean>0.0</mean> <stddev>0.01</stddev> </noise> </ray> <plugin name="gazebo_ros_range_controller" filename="libgazebo_ros_ray_sensor.so"> <ros> <namespace>/range_link</namespace> <remapping>~/out:=range</remapping> </ros> <output_type>sensor_msgs/Range</output_type> <frame_name>range_link</frame_name> <radiation_type>ultrasound</radiation_type> </plugin> </sensor>
No matter where i place the obstacle the output is always -inf as shown here:
header: stamp: sec: 147 nanosec: 945000000 frame_id: range_link radiation_type: 0 field_of_view: 0.17399999499320984 min_range: 0.05000000074505806 max_range: 15.0 range: -.inf
when i change message type to LaserScan and put obstacle in front it works so I think there is some issue in the conversion to a Range message.
The text was updated successfully, but these errors were encountered:
AmmarAlbakri
changed the title
sensor_msgs/Range message broken plugin
libgazebo_ros_ray_sensor plugin sensor_msgs/Range message broken
Jul 16, 2024
I am trying to implement a range measurement plugin using the libgazebo_ros_ray_sensor, i defined the sensor as documented in the migration wiki:
<sensor type="gpu_ray" name="range_sensor"> <visualize>True</visualize> <update_rate>30</update_rate> <ray> <scan> <horizontal> <samples>15</samples> <resolution>1</resolution> <min_angle>-0.087</min_angle> <max_angle>0.087</max_angle> </horizontal> <vertical> <samples>15</samples> <resolution>1</resolution> <min_angle>-0.087</min_angle> <max_angle>0.087</max_angle> </vertical> </scan> <range> <min>0.05</min> <max>15.0</max> <resolution>0.01</resolution> </range> <noise> <type>gaussian</type> <mean>0.0</mean> <stddev>0.01</stddev> </noise> </ray> <plugin name="gazebo_ros_range_controller" filename="libgazebo_ros_ray_sensor.so"> <ros> <namespace>/range_link</namespace> <remapping>~/out:=range</remapping> </ros> <output_type>sensor_msgs/Range</output_type> <frame_name>range_link</frame_name> <radiation_type>ultrasound</radiation_type> </plugin> </sensor>
No matter where i place the obstacle the output is always -inf as shown here:
header: stamp: sec: 147 nanosec: 945000000 frame_id: range_link radiation_type: 0 field_of_view: 0.17399999499320984 min_range: 0.05000000074505806 max_range: 15.0 range: -.inf
when i change message type to LaserScan and put obstacle in front it works so I think there is some issue in the conversion to a Range message.
The text was updated successfully, but these errors were encountered: