test_laser_filter.py
Go to the documentation of this file.
00001 import roslib; roslib.load_manifest('hai_sandbox')
00002 
00003 import rospy
00004 from sensor_msgs.msg import PointCloud
00005 
00006 def callback(data):
00007     print len(data.points)
00008 
00009 def listener():
00010     rospy.init_node('listener', anonymous=True)
00011     rospy.Subscriber("tilt_scan_shadow_filtered", PointCloud, callback)
00012     rospy.spin()
00013 
00014 if __name__ == '__main__':
00015     listener()
00016 


hai_sandbox
Author(s): Hai Nguyen
autogenerated on Wed Nov 27 2013 11:46:56