fake_pub.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import roslib; roslib.load_manifest("turtlebot_arm_bringup")
00004 import rospy
00005 from sensor_msgs.msg import JointState
00006 
00007 rospy.init_node("fake_pub")
00008 p = rospy.Publisher('joint_states', JointState)
00009 
00010 msg = JointState()
00011 msg.name = ["front_castor_joint", "left_wheel_joint", "rear_castor_joint", "right_wheel_joint"]
00012 msg.position = [0.0 for name in msg.name]
00013 msg.velocity = [0.0 for name in msg.name]
00014 
00015 while not rospy.is_shutdown():
00016     msg.header.stamp = rospy.Time.now()
00017     p.publish(msg)
00018     rospy.sleep(0.1)
00019 


pi_head_tracking_3d_part2
Author(s): Patrick Goebel
autogenerated on Mon Jan 6 2014 11:33:57