Go to the documentation of this file.00001
00002
00003
00004
00005 import rospy
00006 from std_msgs.msg import Empty as EmptyMsg
00007 from std_srvs.srv import Empty as EmptySrv
00008 import subprocess
00009
00010 def callback(msg):
00011 rospy.loginfo("Clearing /accumulated_heightmap/reset")
00012 srv = rospy.ServiceProxy("/accumulated_heightmap/reset", EmptySrv)
00013 srv()
00014
00015 if __name__ == "__main__":
00016 rospy.init_node("auto_reset_heightmap")
00017 sub = rospy.Subscriber("/odom_init_trigger", EmptyMsg, callback)
00018 rospy.spin()