38 #include <boost/python.hpp>
40 #include <geometry_msgs/Vector3.h>
50 bool doCompare(
const std::vector<unsigned char>& data, PyObject* obj)
55 Py_ssize_t size = PyBytes_GET_SIZE(
obj);
56 if (size < 0 || std::vector<unsigned char>::size_type(size) !=
data.size())
58 return std::memcmp(py_data, &
data[0], size) == 0;
64 const std::vector<unsigned char> testdata{ 0xff, 0xef, 0x00, 0x10 };
70 const std::vector<unsigned char> testdata{
'm',
'n',
'o' };
98 geometry_msgs::Vector3
v;
106 geometry_msgs::Vector3
v;
108 return v.x == 1.0 &&
v.y == -2.0 &&
v.z == 0.25;
118 bp::class_<ByteStringTestHelper> cls(
"ByteStringTestHelper");