#include "../../src/plugin_router/string_plugin_router.h"
#include <fruit/fruit.h>
#include <gtest/gtest.h>
#include <algorithm>
#include <boost/array.hpp>
#include <boost/asio.hpp>
#include <functional>
#include <iostream>
#include <iterator>
#include <memory>
#include <unordered_map>
#include "../../src/socket/udp_socket.h"
#include "std_msgs/UInt8MultiArray.h"
Go to the source code of this file.
Classes | |
class | MockStringSocket |
Functions | |
Component< Annotated< StringAnnotation, PluginRouterFactory > > | getMockStringPluginRouterComponent () |
Component< SocketFactory > | getMockStringUdpSourceComponent () |
TEST (TestSuite, string_plugin_try_start_not_found_plugin) | |
TEST (TestSuite, string_plugin_try_start_with_invalid_xml) | |
TEST (TestSuite, string_plugin_try_start_with_loopback_plugin) | |
Component<Annotated<StringAnnotation, PluginRouterFactory> > getMockStringPluginRouterComponent | ( | ) |
Definition at line 68 of file string_plugin_router_test.cpp.
Component<SocketFactory> getMockStringUdpSourceComponent | ( | ) |
Definition at line 63 of file string_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
string_plugin_try_start_not_found_plugin | |||
) |
Definition at line 94 of file string_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
string_plugin_try_start_with_invalid_xml | |||
) |
Definition at line 76 of file string_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
string_plugin_try_start_with_loopback_plugin | |||
) |
Definition at line 117 of file string_plugin_router_test.cpp.