#include <rtt/os/startstop.h>
#include <rtt/Logger.hpp>
#include <rtt/deployment/ComponentLoader.hpp>
#include <rtt_roscomm/rostopic.h>
#include <rtt_roscomm/rosservice.h>
#include <std_msgs/typekit/String.h>
#include <std_srvs/Empty.h>
#include <ros/names.h>
#include <ros/service_manager.h>
#include <ros/this_node.h>
#include <boost/weak_ptr.hpp>
#include <gtest/gtest.h>
#include <algorithm>
Go to the source code of this file.
|
bool | callback0 (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
|
bool | callback1 () |
|
void | callback2 () |
|
int | main (int argc, char **argv) |
|
| TEST (TransportTest, OutOfBandTest) |
|
| TEST (TransportTest, VectorTest) |
|
| TEST (TransportTest, ServiceServerTest) |
|
bool callback0 |
( |
std_srvs::Empty::Request & |
, |
|
|
std_srvs::Empty::Response & |
|
|
) |
| |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
TEST |
( |
TransportTest |
, |
|
|
OutOfBandTest |
|
|
) |
| |
Copyright (c) 2013, Jonathan Bohren, all rights reserved. This software is released under the BSD 3-clause license, for the details of this license, please see LICENSE.txt at the root of this repository.
Definition at line 25 of file transport_tests.cpp.
TEST |
( |
TransportTest |
, |
|
|
VectorTest |
|
|
) |
| |
TEST |
( |
TransportTest |
, |
|
|
ServiceServerTest |
|
|
) |
| |