#include "../../src/plugin_router/json_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 | MockJsonSocket |
Functions | |
Component< Annotated< JsonAnnotation, PluginRouterFactory > > | getMockJsonPluginRouterComponent () |
Component< SocketFactory > | getMockJsonUdpSourceComponent () |
TEST (TestSuite, json_plugin_try_start_with_invalid_xml) | |
TEST (TestSuite, json_plugin_try_start_not_found_plugin) | |
TEST (TestSuite, json_plugin_try_start_with_loopback_plugin) | |
Component<Annotated<JsonAnnotation, PluginRouterFactory> > getMockJsonPluginRouterComponent | ( | ) |
Definition at line 70 of file json_plugin_router_test.cpp.
Component<SocketFactory> getMockJsonUdpSourceComponent | ( | ) |
Definition at line 65 of file json_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
json_plugin_try_start_with_invalid_xml | |||
) |
Definition at line 78 of file json_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
json_plugin_try_start_not_found_plugin | |||
) |
Definition at line 97 of file json_plugin_router_test.cpp.
TEST | ( | TestSuite | , |
json_plugin_try_start_with_loopback_plugin | |||
) |
Definition at line 121 of file json_plugin_router_test.cpp.