Adding camera to existing default IRIS quadcopter
Hi,
I'm trying to add a camera to the existing default iris quadcopter in gazebo. I'm following this guide/tutorial . To the iris.sdf
file I added:
<joint name="camera_joint" type="fixed">
<axis xyz="0 1 0" />
<origin xyz="${camera_link} 0 ${height3 - axel_offset*2}" rpy="0 0 0"/>
<parent link="link3"/>
<child link="camera_link"/>
</joint>
<!-- Camera -->
<link name="camera_link">
<collision>
<origin xyz="0 0 0" rpy="0 0 0"/>
<geometry>
<box size="${camera_link} ${camera_link} ${camera_link}"/>
</geometry>
</collision>
<visual>
<origin xyz="0 0 0" rpy="0 0 0"/>
<geometry>
<box size="${camera_link} ${camera_link} ${camera_link}"/>
</geometry>
<material name="red"/>
</visual>
<inertial>
<mass value="1e-5" />
<origin xyz="0 0 0" rpy="0 0 0"/>
<inertia ixx="1e-6" ixy="0" ixz="0" iyy="1e-6" iyz="0" izz="1e-6" />
</inertial>
</link>
And to the iris.xarco
file I added
<xacro:property name="camera_link" value="0.05" /> <!-- Size of square 'camera' box -->
But for some reason when I try to run the simulation, I don't see the added red box (camera). I'm really new to gazebo, I only have been able to fly the drone autonomously controlled via a ROS-node, but thats all. Anyone who could help me?
Thanks!