#include <gtest/gtest.h>
#include <std_msgs/Bool.h>
#include <geometry_msgs/PoseStamped.h>
#include <variant_msgs/Test.h>
#include <variant_topic_tools/DataTypeRegistry.h>
#include <variant_topic_tools/Message.h>
#include <variant_topic_tools/MessageVariant.h>
Go to the source code of this file.
Functions | |
TEST (Message, Conversion) | |
TEST (Message, Serialization) |
Definition at line 33 of file MessageTest.cpp.
Definition at line 64 of file MessageTest.cpp.