Adding a Kinect to my Gazebo simulation
Hello All,
I have a URDF model that is working in gazebo that i copied from the book Programming Robots with ROS. I would like to add a Kinect sensor to this model so i can simulate my robot but i cant for the life of me figure out how do this. Most resources that i found are like this example. which says that i should use the model found in the turtlebot_description folder but i am unsure what files i need and how exactly to import them into my URDF. I found this tutorial which edits the kinect model found in the gazebo models folder, and this worked perfectly so i know its possible. I think what i need is for someone to really spell it out for me what i need to add to my urdf and my launch file to add a kinect.
Here is my URDF I would like to replace the hokuyo_link with a Kinect:
<?xml version="1.0"?>
<robot name="tortoisebot">
<link name="base_link">
<visual>
<geometry>
<box size="0.6 0.3 0.3"/>
</geometry>
<material name="silver">
<color rgba="0.75 0.75 0.75 1"/>
</material>
</visual>
<collision>
<geometry>
<box size="0.6 0.3 0.3"/>
</geometry>
</collision>
<inertial>
<mass value="1.0"/>
<inertia ixx="0.015" iyy="0.0375" izz="0.0375" ixy="0" ixz="0" iyz="0"/>
</inertial>
</link>
<link name="front_caster">
<visual>
<geometry>
<box size="0.1 0.1 0.3"/>
</geometry>
<material name="silver"/>
</visual>
<collision>
<geometry>
<box size="0.1 0.1 0.3"/>
</geometry>
</collision>
<inertial>
<mass value="0.1"/>
<inertia ixx="0.00083" iyy="0.00083" izz="0.000167" ixy="0" ixz="0" iyz="0"/>
</inertial>
</link>
<joint name="front_caster_joint" type="continuous">
<axis xyz="0 0 1"/>
<parent link="base_link"/>
<child link="front_caster" />
<origin rpy="0 0 0" xyz="0.3 0 0" />
</joint>
<link name="front_wheel">
<visual>
<geometry>
<cylinder length="0.05" radius="0.035"/>
</geometry>
<material name="black" />
</visual>
<collision>
<geometry>
<cylinder length="0.05" radius="0.035"/>
</geometry>
</collision>
<inertial>
<mass value="0.1"/>
<inertia ixx="5.1458e-5" iyy="5.1458e-5" izz="6.125e-5" ixy="0" ixz="0" iyz="0"/>
</inertial>
</link>
<joint name="front_wheel_joint" type="continuous">
<axis xyz="0 0 1"/>
<parent link="front_caster"/>
<child link="front_wheel"/>
<origin rpy="-1.5708 0 0" xyz="0.05 0 -0.15"/>
</joint>
<link name="right_wheel">
<visual>
<geometry>
<cylinder length="0.05" radius="0.035"/>
</geometry>
<material name="black" />
</visual>
<collision>
<geometry>
<cylinder length="0.05" radius="0.035"/>
</geometry>
</collision>
<inertial>
<mass value="0.1"/>
<inertia ixx="5.1458e-5" iyy="5.1458e-5" izz="6.125e-5" ixy="0" ixz="0" iyz ...