Go to the source code of this file.
Namespaces | |
namespace | ik_openrave |
Functions | |
def | ik_openrave.GetPositionIKFn |
def | ik_openrave.IKFn |
def | ik_openrave.UpdateRobotJoints |
Variables | |
string | ik_openrave.__author__ = 'Rosen Diankov' |
string | ik_openrave.__copyright__ = 'Copyright (C) 2010 Rosen Diankov (rosen.diankov@gmail.com)' |
string | ik_openrave.__license__ = 'Apache License, Version 2.0' |
tuple | ik_openrave.ab = robot.ComputeAABB() |
tuple | ik_openrave.collisionmap = RaveCreateSensorSystem(env,'CollisionMap bodyoffset %s topic %s'%(robot.GetName(),options.collision_map)) |
tuple | ik_openrave.env = OpenRAVEGlobalArguments.parseAndCreate(options,defaultviewer=True) |
tuple | ik_openrave.ground = RaveCreateKinBody(env,'') |
string | ik_openrave.help = 'scene to load (default=%default)' |
tuple | ik_openrave.ipshell = IPShellEmbed(argv='',banner = 'Dropping into IPython',exit_msg = 'Leaving Interpreter, back to program.') |
tuple | ik_openrave.listener = tf.TransformListener() |
string | ik_openrave.namespace = 'openrave' |
tuple | ik_openrave.parser = OptionParser(description='openrave planning example') |
tuple | ik_openrave.robot = env.GetRobots() |
tuple | ik_openrave.s1 = rospy.Service('IK', orrosplanning.srv.IK, IKFn) |
tuple | ik_openrave.s2 = rospy.Service('GetPositionIK', kinematics_msgs.srv.GetPositionIK, GetPositionIKFn) |
tuple | ik_openrave.sub = rospy.Subscriber("/joint_states", sensor_msgs.msg.JointState, UpdateRobotJoints,queue_size=1) |
tuple | ik_openrave.values = robot.GetDOFValues() |
tuple | ik_openrave.valueslock = threading.Lock() |