Go to the documentation of this file.00001
00002
00003 import roslib; roslib.load_manifest('rospy_tutorials')
00004
00005 import rospy
00006 from std_msgs.msg import String
00007 from std_msgs.msg import Int16
00008 from map_mux.srv import *
00009
00010 def talker():
00011 rospy.init_node('talker', anonymous=True)
00012 print 12
00013 rospy.wait_for_service('change_map')
00014 print 13
00015
00016
00017 r = rospy.Rate(.2)
00018 i = 1
00019 while not rospy.is_shutdown():
00020 if i == 1:
00021 i = 2
00022 elif i == 2:
00023 i = 3
00024 elif i == 3:
00025 i = 1
00026 try:
00027 change_map = rospy.ServiceProxy('change_map', ChangeMap)
00028
00029 ii = change_map(i)
00030 print i
00031 print "..."+str(ii)
00032 except rospy.ServiceException , e:
00033 print "failure"
00034
00035
00036
00037 r.sleep()
00038
00039 if __name__ == '__main__':
00040 try:
00041 talker()
00042 except rospy.ROSInterruptException: pass
00043
00044
00045
00046
00047
00048
00049
00050
00051
00052
00053
00054
00055
00056
00057
00058
00059
00060
00061
00062
00063
00064
00065
00066
00067
00068
00069
00070
00071
00072
00073
00074
00075