Test for shape_shifter.h . More...
#include "gtest/gtest.h"#include <string>#include <utility>#include <vector>#include <ros/serialization.h>#include <cras_topic_tools/shape_shifter.h>#include <std_msgs/Bool.h>#include <std_msgs/Header.h>#include <std_msgs/String.h>#include <geometry_msgs/Point.h>#include <geometry_msgs/PointStamped.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| TEST (ShapeShifter, CopyCrasShapeShifter) | |
| TEST (ShapeShifter, CopyShapeShifter) | |
| TEST (ShapeShifter, GetBuffer) | |
| TEST (ShapeShifter, GetHeaderFromBool) | |
| TEST (ShapeShifter, GetHeaderFromFakeString) | |
| TEST (ShapeShifter, GetHeaderFromHeader) | |
| TEST (ShapeShifter, GetHeaderFromLongString) | |
| TEST (ShapeShifter, GetHeaderPoint) | |
| TEST (ShapeShifter, GetHeaderPointStamped) | |
| TEST (ShapeShifter, MessageTraits) | |
| TEST (ShapeShifter, MsgToShapeShifter) | |
| TEST (ShapeShifter, SetHeaderLonger) | |
| TEST (ShapeShifter, SetHeaderSameLength) | |
| TEST (ShapeShifter, SetHeaderShorter) | |
Test for shape_shifter.h .
Definition in file test_shape_shifter.cpp.
Definition at line 371 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| CopyCrasShapeShifter | |||
| ) |
Definition at line 313 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| CopyShapeShifter | |||
| ) |
Definition at line 289 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetBuffer | |||
| ) |
Definition at line 60 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderFromBool | |||
| ) |
Definition at line 151 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderFromFakeString | |||
| ) |
Definition at line 183 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderFromHeader | |||
| ) |
Definition at line 132 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderFromLongString | |||
| ) |
Definition at line 167 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderPoint | |||
| ) |
Definition at line 112 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| GetHeaderPointStamped | |||
| ) |
Definition at line 90 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| MessageTraits | |||
| ) |
Definition at line 343 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| MsgToShapeShifter | |||
| ) |
Definition at line 24 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| SetHeaderLonger | |||
| ) |
Definition at line 260 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| SetHeaderSameLength | |||
| ) |
Definition at line 202 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , |
| SetHeaderShorter | |||
| ) |
Definition at line 231 of file test_shape_shifter.cpp.