trial_sub.py
Go to the documentation of this file.
00001 import roslib; roslib.load_manifest('hrl_lib')
00002 import rospy
00003 import std_srvs.srv as srv
00004 from hrl_msgs.msg import FloatArray
00005 
00006 import time
00007 
00008 def cb( msg ):
00009     print 'Received msg: ', msg, '\n\tType: ', msg.__class__
00010     return
00011 
00012 x = 3.0
00013 rospy.init_node('trial_subscriber')
00014 sub = rospy.Subscriber('trial_pub', FloatArray, cb)
00015 
00016 while not rospy.is_shutdown():
00017     rospy.spin()


force_torque
Author(s): Advait Jain, Cressel Anderson, Hai Nguyen, Advisor: Prof. Charlie Kemp, Lab: Healthcare Robotics Lab at Georgia Tech
autogenerated on Wed Nov 27 2013 11:58:12