Size: 1912
Comment:
|
Size: 2035
Comment:
|
Deletions are marked like this. | Additions are marked like this. |
Line 43: | Line 43: |
#!python import sys import copy import rospy import moveit_commander import moveit_msgs.msg import geometry_msgs.msg |
!
![]() |
Moveit Tutorial
Description: In this tutorial we will explain about our moveit package, and how to work with it.Keywords: ric_moveit,komodo moveit
Tutorial Level: INTERMEDIATE
Getting started
First of all you need to install the moveit itself, installing moveit is easy just open a new terminal and type the following command
$ sudo apt-get install ros-indigo-moveit-full
Moveit
NOTE: Right now there only two komodo model which support moveit functionality
- Komodo with arm.
- Komodo with elevator and arm.
Moveit api
About the API
In MoveIt!, the primary user interface is through the RobotCommander class. It provides functionality for most operations that a user may want to carry out, specifically setting joint or pose goals, creating motion plans, moving the robot, adding objects into the environment and attaching/detaching objects from the robot.
Setup
To use the python interface to move_group, import the moveit_commander module. We also import rospy and some messages that we will use.