cursor3d_listener.py
Go to the documentation of this file.
00001 from pkg import *
00002 from geometry_msgs.msg import Point
00003 import sys
00004 
00005 class Echo:
00006     def echo(self, point):
00007         print 'x y z', point.x, point.y, point.z
00008 
00009 rospy.Publisher(CURSOR_TOPIC, Point, Echo().echo)
00010 rospy.init_node('cursor3d_listener')
00011 rospy.spin()
00012 
00013 
00014 
00015 
00016 


laser_interface
Author(s): Hai Nguyen and Travis Deyle. Advisor: Prof. Charlie Kemp, Lab: Healthcare Robotics Lab at Georgia Tech
autogenerated on Wed Nov 27 2013 11:45:51