#include <string>
#include <vector>
#include <gtest/gtest.h>
#include "opencv2/core/core.hpp"
#include "cv_bridge/cv_bridge.h"
#include <sensor_msgs/Image.h>
#include <sensor_msgs/image_encodings.h>
Go to the source code of this file.
Functions | |
std::vector< std::string > | getEncodings () |
bool | isUnsigned (const std::string &encoding) |
TEST (OpencvTests, testCase_encode_decode) |
std::vector<std::string> getEncodings | ( | ) |
Definition at line 55 of file utest2.cpp.
bool isUnsigned | ( | const std::string & | encoding | ) |
Definition at line 47 of file utest2.cpp.
TEST | ( | OpencvTests | , |
testCase_encode_decode | |||
) |
Definition at line 71 of file utest2.cpp.