#include "rosmsg_cpp/rosmsg_cpp.h"#include <geometry_msgs/Point.h>#include <geometry_msgs/TwistWithCovarianceStamped.h>#include <geometry_msgs/Vector3.h>#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
| std::string | appendNewline (const std::string &str) |
| int | main (int argc, char **argv) |
| TEST (CppMsgDef, getFullDef) | |
| TEST (CppMsgDef, getMD5Sum) | |
| TEST (CppMsgDef, hasHeader) | |
| TEST (CppMsgDef, getFieldNames) | |
| TEST (CppMsgDef, getFieldTypes) | |
| TEST (CppMsgDef, getMsgFile) | |
| TEST (CppMsgDef, getMD5Text) | |