Go to the documentation of this file.00001
00002 import roslib; roslib.load_manifest('entropy_descriptor_node')
00003
00004 import rospy
00005
00006 from entropy_descriptor_node.msg import heat_map
00007 import numpy as np
00008 import pylab
00009
00010 def show_map(data):
00011
00012 hmap=np.array(data.data)
00013 hmap.shape = (data.height, data.width)
00014 print hmap, hmap.max()
00015 pylab.imshow(hmap.astype('float'))
00016 pylab.colorbar()
00017 pylab.draw()
00018
00019
00020 if __name__ == '__main__':
00021 print "check map"
00022 pylab.ion()
00023 rospy.init_node('check_map')
00024 rospy.Subscriber("/entropy_descriptor_driver_node/wrinkled_map", heat_map, show_map)
00025 rospy.spin()
00026
00027
00028
00029
00030
00031
00032