38 from sensor_msgs.msg
import JointState
39 from geometry_msgs.msg
import Twist
42 This demonstration controls the end effector to move in a circle through cartesian velocity commands 43 To control the end effector through cartesian velocity, the robot must be in velocity mode. 51 d_angle = angle_resolution*3.14/180
57 rospy.loginfo(
"Sending velocity commands.")
58 while i < (360/angle_resolution):
60 ee_x = x_center + radius*math.cos(angle);
61 ee_y = y_center + radius* math.sin(angle);
62 twst_cmd.linear.x = ee_x
63 twst_cmd.linear.z = ee_y
64 vel_pub.publish(twst_cmd)
65 rospy.loginfo(twst_cmd)
68 vel_pub.publish(Twist())
72 rospy.init_node(
'revel_circular_eef', anonymous=
False)
74 vel_pub = rospy.Publisher(
'/revel/eef_velocity', Twist, queue_size=1)
77 rospy.loginfo(
"Setting up Revel Circle Movement program")
79 if __name__ ==
'__main__':
83 except rospy.ROSInterruptException: