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_circ_interface')
00027
00028 pose = sci.gen_pose(pos=[0.0, 0.7, 1.0], rpy=[0.0, 0.0, 0.0])
00029 start_angle = 0.0 * math.pi / 180.0
00030 end_angle = 90.0 * math.pi / 180.0
00031 profile = Profile()
00032 profile.vel = 0.2
00033 profile.accl = 0.1
00034
00035 profile.profile_type = Profile.RAMP
00036
00037 success, message = sci.move_circ(pose, "world", start_angle, end_angle, 0.3, profile)
00038 if success:
00039 rospy.loginfo(message)
00040 else:
00041 rospy.logerr(message)