00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00031
00032
00033
00034
00035 import roslib
00036 roslib.load_manifest('test_rosbag')
00037
00038 import unittest
00039 import rospy
00040 import rostest
00041 import sys
00042 from cStringIO import StringIO
00043 import time
00044 from random_messages import RandomMsgGen
00045 import subprocess
00046 import signal
00047 import os
00048 import atexit
00049
00050 class RandomRecord(unittest.TestCase):
00051
00052 def test_random_record(self):
00053 rospy.init_node('random_pub')
00054
00055 if (len(sys.argv) < 2):
00056 raise Exception("Expected seed as first argument")
00057
00058 seed = int(sys.argv[1])
00059
00060 seed = int(sys.argv[1])
00061 topics = int(sys.argv[2])
00062 length = float(sys.argv[3])
00063
00064 rmg = RandomMsgGen(seed, topics, length)
00065
00066 publishers = {}
00067
00068 for (topic, msg_class) in rmg.topics():
00069 publishers[topic] = rospy.Publisher(topic, msg_class)
00070
00071 bagpath = os.path.join('/tmp', 'test_rosbag_random_record_%d'%seed)
00072 cmd = ['rosbag', 'record', '-a', '-O', bagpath]
00073 f1 = subprocess.Popen(cmd)
00074
00075 def finalkill():
00076 try:
00077 os.kill(f1.pid, signal.SIGKILL)
00078 except:
00079 pass
00080
00081 atexit.register(finalkill)
00082
00083
00084 rospy.sleep(rospy.Duration.from_sec(5.0))
00085
00086 start = rospy.Time.now()
00087 for (topic, msg, time) in rmg.messages():
00088 d = start + rospy.Duration.from_sec(time) - rospy.Time.now()
00089 rospy.sleep(d)
00090 publishers[topic].publish(msg)
00091
00092
00093 rospy.sleep(rospy.Duration.from_sec(5.0))
00094
00095
00096 os.kill(f1.pid, signal.SIGINT)
00097
00098
00099 rospy.sleep(rospy.Duration.from_sec(5.0))
00100
00101
00102 while (f1.poll() is None):
00103 try:
00104 os.kill(f1.pid, signal.SIGKILL)
00105 except:
00106 pass
00107 rospy.sleep(rospy.Duration.from_sec(1.0))
00108
00109 self.assertEqual(f1.returncode, 0)
00110
00111
00112 if __name__ == '__main__':
00113 rostest.rosrun('test_rosbag', 'random_record_play', RandomRecord, sys.argv)