Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018 import math
00019 import rospy
00020
00021 from geometry_msgs.msg import Pose
00022 from cob_cartesian_controller.msg import Profile
00023 import simple_cartesian_interface as sci
00024
00025 if __name__ == '__main__':
00026 rospy.init_node('test_move_lin_interface')
00027
00028 pose = sci.gen_pose(pos=[-0.9, 0.0, 0.0], rpy=[0.0, 0.0, 0.0])
00029 profile = Profile()
00030 profile.vel = 0.2
00031 profile.accl = 0.1
00032
00033 profile.profile_type = Profile.RAMP
00034
00035 success, message = sci.move_lin(pose, "world", profile)
00036 if success:
00037 rospy.loginfo(message)
00038 else:
00039 rospy.logerr(message)