• Diff for "ric_moveit/komodo moveit"
Differences between revisions 21 and 22
Revision 21 as of 2015-11-22 07:21:48
Size: 1912
Editor: tomwiss1231
Comment:
Revision 22 as of 2015-11-22 07:24:03
Size: 2035
Editor: tomwiss1231
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

!

(!) Please ask about problems and questions regarding this tutorial on answers.ros.org. Don't forget to include in your question the link to this page, the versions of your OS & ROS, and also add appropriate tags.

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.

Toggle line numbers
   1 import sys
   2 import copy
   3 import rospy
   4 import moveit_commander
   5 import moveit_msgs.msg
   6 import geometry_msgs.msg

Wiki: ric_moveit/komodo moveit (last edited 2015-11-22 07:41:59 by tomwiss1231)