Difference between revisions of "MYRAbot model for simulation (urdf+gazebo)"

From robotica.unileon.es
Jump to: navigation, search
(Created page with " < go back to main ==Components of MYRAbot model== <!-- ==Componentes del modelo del MYRAbot== Se ha comenzado realizado un modelo de la estructura ...")
 
(Components of MYRAbot model)
Line 2: Line 2:
  
 
==Components of MYRAbot model==
 
==Components of MYRAbot model==
 +
 +
We have started creating a model of the MYRAbot's structure and we have added the mobile base [http://store.irobot.com/family/index.jsp?categoryId=3358508&s=A-ProductAge Roomba], the [http://www.xbox.com/es-ES/Kinect kinect] camera, the [[MYRAbot's arm model for simulation (urdf+gazebo)|arm model]] and the webcam [http://www.logitech.com/es-es/support/5867?crid=405 Logitech Webcam Pro 9000].
 +
 +
First, we will create a new ''package'' with the necessary dependences for our programs (urdf std_msgs sensor_msgs tf roscpp). We will execute the next commands in a terminal:
 +
 +
<syntaxhighlight>
 +
cd ~/ros_workspace
 +
roscreate-pkg myrabot_fer_modelo urdf std_msgs sensor_msgs tf roscpp</syntaxhighlight>
 +
 +
===URDF MYRAbot's structure===
 +
 +
 +
 
<!--
 
<!--
==Componentes del modelo del MYRAbot==
 
 
Se ha comenzado realizado un modelo de la estructura del MYRAbot a le que se le ha añadido la base [http://store.irobot.com/family/index.jsp?categoryId=3358508&s=A-ProductAge Roomba], la cámara [http://www.xbox.com/es-ES/Kinect kinect], el [[Modelo para simulación brazo MYRAbot (urdf+gazebo)|brazo modelado]] y la cámara web [http://www.logitech.com/es-es/support/5867?crid=405 Logitech Webcam Pro 9000]. Hemos comenzado [[Fernando-TFM-ROS02#Creando un package|creando un package]] que va a contener el modelo de nuestro robot, que llamaremos "myrabot_fer_modelo", con la dependencia urdf.
 
  
 
===URDF estructura MYRAbot===
 
===URDF estructura MYRAbot===

Revision as of 12:24, 10 January 2014

< go back to main

Components of MYRAbot model

We have started creating a model of the MYRAbot's structure and we have added the mobile base Roomba, the kinect camera, the arm model and the webcam Logitech Webcam Pro 9000.

First, we will create a new package with the necessary dependences for our programs (urdf std_msgs sensor_msgs tf roscpp). We will execute the next commands in a terminal:

cd ~/ros_workspace
roscreate-pkg myrabot_fer_modelo urdf std_msgs sensor_msgs tf roscpp

URDF MYRAbot's structure

< go back to main