Go to the documentation of this file.00001 
00002 
00003 import roslib; roslib.load_manifest('cob_3d_mapping_point_map')
00004 import rospy
00005 import actionlib
00006 import sys
00007 
00008 from cob_3d_mapping_msgs.msg import *
00009 
00010 if __name__ == '__main__':
00011     if len(sys.argv) <= 1:
00012         print "Please provide the input argument \"start\" or \"stop.\""
00013         sys.exit()
00014     rospy.init_node('trigger_mapping')
00015     client = actionlib.SimpleActionClient('trigger_mapping', TriggerAction)
00016     client.wait_for_server()
00017 
00018     goal = TriggerGoal()
00019     if sys.argv[1] == "start":
00020         goal.start = True
00021     elif sys.argv[1] == "stop":
00022         goal.start = False
00023     else:
00024         print "Input argument has to be \"start\" or \"stop\""
00025     
00026     client.send_goal(goal)
00027     client.wait_for_result(rospy.Duration.from_sec(5.0))
00028