Set intensity for an object so gazebo_ros_laser will notice
Hey, I'm very new to ros and gazebo.
I'm trying to make the gazeboroslaser notice a reflecting Object.
But when I check this->parent_ray_sensor_->GetLaserShape()->GetRetro(ja)
in the gazebo_ros_laser.cpp
it is set to zero.
in my urdf file i set the laser retro value to 200
<robot name="reflector">
<link name="test_reflector">
<inertial>
<origin xyz="5 5 2" />
<mass value="1.0" />
<inertia ixx="0.0" ixy="0.0" ixz="0.0" iyy="0.0" iyz="0.0" izz="0.0" />
</inertial>
<visual>
<origin xyz="5 5 2"/>
<geometry>
<box size="1 1 2" />
</geometry>
<material name="Cyan">
<color rgba="0 1.0 1.0 1.0"/>
</material>
<laserRetro>200.0</laserRetro>
</visual>
<collision>
<origin xyz="5 5 2"/>
<geometry>
<box size="1 1 2" />
</geometry>
<laserRetro>200.0</laserRetro>
</collision>
</link>
<gazebo reference="test_reflector">
<material>Gazebo/Grey</material>
<laserRetro>200</laserRetro>
<turnGravityOff>true</turnGravityOff>
</gazebo>
could you please tell me what I'm doing wrong?
Also I would really like to know how the information I specified in the urdf-file finally gets to the class RayShape. Should this not happen somewhere in urdf2gazebo.cpp?
Thanks for your help