Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020 #include <iostream>
00021
00022 #include <ros/console.h>
00023
00024 #include <socrob/multicast.h>
00025
00026 #include "TestShortMultipleDelay.h"
00027
00028
00029
00030 using namespace std;
00031 using namespace ros;
00032 using namespace socrob::multicast;
00033
00034
00035
00036 int main (int argc, char** argv)
00037 {
00038 init (argc, argv, "short_multiple_delay");
00039
00040 ros::NodeHandle nh;
00041
00042 int sid;
00043 if (! ros::param::getCached ("robot_number", sid)) {
00044 ROS_FATAL ("Could not get robot_number param");
00045 abort();
00046 }
00047 sid -= 1;
00048
00049 TestShortMultipleDelay test_short (sid, "Normal");
00050
00051 {
00052 Manager srmm (ManagerOptions (sid, 5, "239.255.1.1")
00053 .bandwidth_bps (57671)
00054 .ports (2000, 2001)
00055 .tup_ms (100)
00056 .short_handler (boost::bind (&TestShortMultipleDelay::short_handler, boost::ref (test_short), _1, _2, _3)));
00057
00058 ros::Rate loop_rate (10);
00059 while (ros::ok()) {
00060 test_short.timer (srmm);
00061 loop_rate.sleep();
00062 }
00063 }
00064
00065 test_short.statistics();
00066 }