#include "config.h"#include <gtest/gtest.h>#include <geometry_msgs/Pose.h>#include <sensor_msgs/NavSatStatus.h>#include <sensor_msgs/Imu.h>#include <std_msgs/Int16MultiArray.h>#include "ros_type_introspection/ros_introspection.hpp"
Go to the source code of this file.
Functions | |
| TEST (RosType, builtin_int32) | |
| TEST (RosType, builtin_string) | |
| TEST (RosType, builtin_fixedlen_array) | |
| TEST (RosType, builtin_dynamic_array) | |
| TEST (RosType, no_builtin_array) | |
| TEST (ROSMessageFields, ParseComments) | |
| TEST (ROSMessageFields, constant_uint8) | |
| TEST (ROSMessageFields, ConstantNavstatus) | |
| TEST (ROSMessageFields, ConstantComments) | |
| TEST (BuildROSTypeMapFromDefinition, IMUparsing) | |
| TEST (BuildROSTypeMapFromDefinition, Int16MultiArrayParsing) | |
| TEST | ( | RosType | , |
| builtin_int32 | |||
| ) |
Definition at line 13 of file parser_test.cpp.
| TEST | ( | RosType | , |
| builtin_string | |||
| ) |
Definition at line 27 of file parser_test.cpp.
| TEST | ( | RosType | , |
| builtin_fixedlen_array | |||
| ) |
Definition at line 41 of file parser_test.cpp.
| TEST | ( | RosType | , |
| builtin_dynamic_array | |||
| ) |
Definition at line 55 of file parser_test.cpp.
| TEST | ( | RosType | , |
| no_builtin_array | |||
| ) |
Definition at line 70 of file parser_test.cpp.
| TEST | ( | ROSMessageFields | , |
| ParseComments | |||
| ) |
Definition at line 84 of file parser_test.cpp.
| TEST | ( | ROSMessageFields | , |
| constant_uint8 | |||
| ) |
Definition at line 107 of file parser_test.cpp.
| TEST | ( | ROSMessageFields | , |
| ConstantNavstatus | |||
| ) |
Definition at line 118 of file parser_test.cpp.
| TEST | ( | ROSMessageFields | , |
| ConstantComments | |||
| ) |
Definition at line 166 of file parser_test.cpp.
| TEST | ( | BuildROSTypeMapFromDefinition | , |
| IMUparsing | |||
| ) |
Definition at line 234 of file parser_test.cpp.
| TEST | ( | BuildROSTypeMapFromDefinition | , |
| Int16MultiArrayParsing | |||
| ) |
Definition at line 306 of file parser_test.cpp.