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/PointStamped.h>
Go to the source code of this file.
| Functions | |
| int | main (int argc, char **argv) | 
| TEST (ShapeShifter, MsgToShapeShifter) | |
| TEST (ShapeShifter, GetBuffer) | |
| TEST (ShapeShifter, GetHeaderOK) | |
| TEST (ShapeShifter, GetHeaderFromHeader) | |
| TEST (ShapeShifter, GetHeaderFromBool) | |
| TEST (ShapeShifter, GetHeaderFromLongString) | |
| TEST (ShapeShifter, GetHeaderFromFakeString) | |
| TEST (ShapeShifter, SetHeaderSameLength) | |
| TEST (ShapeShifter, SetHeaderShorter) | |
| TEST (ShapeShifter, SetHeaderLonger) | |
| TEST (ShapeShifter, CopyShapeShifter) | |
| TEST (ShapeShifter, CopyCrasShapeShifter) | |
Test for shape_shifter.h .
Definition in file test_shape_shifter.cpp.
Definition at line 312 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| MsgToShapeShifter | |||
| ) | 
Definition at line 23 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetBuffer | |||
| ) | 
Definition at line 59 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetHeaderOK | |||
| ) | 
Definition at line 89 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetHeaderFromHeader | |||
| ) | 
Definition at line 109 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetHeaderFromBool | |||
| ) | 
Definition at line 126 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetHeaderFromLongString | |||
| ) | 
Definition at line 140 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| GetHeaderFromFakeString | |||
| ) | 
Definition at line 154 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| SetHeaderSameLength | |||
| ) | 
Definition at line 171 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| SetHeaderShorter | |||
| ) | 
Definition at line 200 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| SetHeaderLonger | |||
| ) | 
Definition at line 229 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| CopyShapeShifter | |||
| ) | 
Definition at line 258 of file test_shape_shifter.cpp.
| TEST | ( | ShapeShifter | , | 
| CopyCrasShapeShifter | |||
| ) | 
Definition at line 282 of file test_shape_shifter.cpp.