#include <rtt/os/startstop.h>#include <rtt/Logger.hpp>#include <rtt/deployment/ComponentLoader.hpp>#include <rtt_roscomm/rtt_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.
Functions | |
| bool | callback (std_srvs::Empty::Request &, std_srvs::Empty::Response &) |
| int | main (int argc, char **argv) |
| TEST (TransportTest, OutOfBandTest) | |
| TEST (TransportTest, VectorTest) | |
| TEST (TransportTest, ServiceServerTest) | |
Variables | |
| static int | callback_called = 0 |
| bool callback | ( | std_srvs::Empty::Request & | , |
| std_srvs::Empty::Response & | |||
| ) |
Definition at line 121 of file transport_tests.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 164 of file transport_tests.cpp.
| 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 | |||
| ) |
Definition at line 82 of file transport_tests.cpp.
| TEST | ( | TransportTest | , |
| ServiceServerTest | |||
| ) |
Definition at line 127 of file transport_tests.cpp.
int callback_called = 0 [static] |
Definition at line 120 of file transport_tests.cpp.