long_tip_pose.py
Go to the documentation of this file.
00001 import roslib
00002 roslib.load_manifest("phantom_omni")
00003 import rospy
00004 import tf
00005 import math
00006 
00007 from geometry_msgs.msg import PoseStamped
00008 import pdb
00009 
00010 rospy.init_node("long_tip_pose_publisher")
00011 pub = rospy.Publisher('pr2_right', PoseStamped)
00012 r = rospy.Rate(60)
00013 
00014 while not rospy.is_shutdown():
00015     ps = PoseStamped()
00016     ps.header.frame_id = 'omni1_link6'
00017     ps.header.stamp = rospy.get_rostime()
00018     ps.pose.position.x = -.134 
00019     ps.pose.position.y = 0
00020     ps.pose.position.z = 0
00021     q = tf.transformations.quaternion_from_euler(0, math.pi, 0)
00022     ps.pose.orientation.x = q[0]
00023     ps.pose.orientation.y = q[1]
00024     ps.pose.orientation.z = q[2]
00025     ps.pose.orientation.w = q[3]
00026     pub.publish(ps)
00027     r.sleep()
00028 
00029 
00030 


phantom_omni
Author(s): Hai Nguyen, Marc Killpack, Chi-Hung King, Advisor: Prof. Charlie Kemp, Lab: Healthcare Robotics Lab at Georgia Tech
autogenerated on Wed Nov 27 2013 11:51:14