Go to the documentation of this file.
6 #ifndef STD_MSGS_MESSAGE_UINT32MULTIARRAY_H
7 #define STD_MSGS_MESSAGE_UINT32MULTIARRAY_H
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
23 template <
class ContainerAllocator>
40 typedef ::std_msgs::MultiArrayLayout_<ContainerAllocator>
_layout_type;
43 typedef std::vector<uint32_t, typename ContainerAllocator::template rebind<uint32_t>::other >
_data_type;
49 typedef std::shared_ptr< ::std_msgs::UInt32MultiArray_<ContainerAllocator> >
Ptr;
50 typedef std::shared_ptr< ::std_msgs::UInt32MultiArray_<ContainerAllocator>
const>
ConstPtr;
63 template<
typename ContainerAllocator>
64 std::ostream&
operator<<(std::ostream& s, const ::std_msgs::UInt32MultiArray_<ContainerAllocator> & v)
74 namespace message_traits
87 template <
class ContainerAllocator>
92 template <
class ContainerAllocator>
97 template <
class ContainerAllocator>
102 template <
class ContainerAllocator>
107 template <
class ContainerAllocator>
112 template <
class ContainerAllocator>
118 template<
class ContainerAllocator>
123 return "4d6a180abc9be191b96a7eda6c8a233d";
126 static const char*
value(const ::std_msgs::UInt32MultiArray_<ContainerAllocator>&) {
return value(); }
127 static const uint64_t static_value1 = 0x4d6a180abc9be191ULL;
128 static const uint64_t static_value2 = 0xb96a7eda6c8a233dULL;
131 template<
class ContainerAllocator>
136 return "std_msgs/UInt32MultiArray";
139 static const char*
value(const ::std_msgs::UInt32MultiArray_<ContainerAllocator>&) {
return value(); }
142 template<
class ContainerAllocator>
147 return "# Please look at the MultiArrayLayout message definition for\n\
148 # documentation on all multiarrays.\n\
150 MultiArrayLayout layout # specification of data layout\n\
151 uint32[] data # array of data\n\
154 ================================================================================\n\
155 MSG: std_msgs/MultiArrayLayout\n\
156 # The multiarray declares a generic multi-dimensional array of a\n\
157 # particular data type. Dimensions are ordered from outer most\n\
160 MultiArrayDimension[] dim # Array of dimension properties\n\
161 uint32 data_offset # padding elements at front of data\n\
163 # Accessors should ALWAYS be written in terms of dimension stride\n\
164 # and specified outer-most dimension first.\n\
166 # multiarray(i,j,k) = data[data_offset + dim_stride[1]*i + dim_stride[2]*j + k]\n\
168 # A standard, 3-channel 640x480 image with interleaved color channels\n\
169 # would be specified as:\n\
171 # dim[0].label = \"height\"\n\
172 # dim[0].size = 480\n\
173 # dim[0].stride = 3*640*480 = 921600 (note dim[0] stride is just size of image)\n\
174 # dim[1].label = \"width\"\n\
175 # dim[1].size = 640\n\
176 # dim[1].stride = 3*640 = 1920\n\
177 # dim[2].label = \"channel\"\n\
179 # dim[2].stride = 3\n\
181 # multiarray(i,j,k) refers to the ith row, jth column, and kth channel.\n\
183 ================================================================================\n\
184 MSG: std_msgs/MultiArrayDimension\n\
185 string label # label of given dimension\n\
186 uint32 size # size of given dimension (in type units)\n\
187 uint32 stride # stride of given dimension\n\
191 static const char*
value(const ::std_msgs::UInt32MultiArray_<ContainerAllocator>&) {
return value(); }
199 namespace serialization
204 template<
typename Stream,
typename T>
inline static void allInOne(
Stream& stream, T m)
206 stream.next(m.layout);
218 namespace message_operations
221 template<
class ContainerAllocator>
224 template<
typename Stream>
static void stream(Stream& s,
const std::string&
indent, const ::std_msgs::UInt32MultiArray_<ContainerAllocator>& v)
229 s <<
indent <<
"data[]" << std::endl;
230 for (
size_t i = 0; i < v.data.size(); ++i)
232 s <<
indent <<
" data[" << i <<
"]: ";
241 #endif // STD_MSGS_MESSAGE_UINT32MULTIARRAY_H
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
::std_msgs::MultiArrayLayout_< ContainerAllocator > _layout_type
Templated serialization class. Default implementation provides backwards compatibility with old messa...
static const char * value()
static const char * value()
static void stream(Stream &s, const std::string &indent, const ::std_msgs::UInt32MultiArray_< ContainerAllocator > &v)
static void stream(Stream &s, const std::string &indent, const M &value)
static const char * value()
A fixed-size datatype is one whose size is constant, i.e. it has no variable-length arrays or strings...
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
static const char * value(const ::std_msgs::UInt32MultiArray_< ContainerAllocator > &)
static void allInOne(Stream &stream, T m)
Specialize to provide the datatype for a message.
static const char * value(const ::std_msgs::UInt32MultiArray_< ContainerAllocator > &)
Specialize to provide the definition for a message.
std::shared_ptr< ::std_msgs::UInt32MultiArray_< ContainerAllocator > > Ptr
static const char * value(const ::std_msgs::UInt32MultiArray_< ContainerAllocator > &)
UInt32MultiArray_< ContainerAllocator > Type
std::shared_ptr< ::std_msgs::UInt32MultiArray const > UInt32MultiArrayConstPtr
UInt32MultiArray_(const ContainerAllocator &_alloc)
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Specialize to provide the md5sum for a message.
std::vector< uint32_t, typename ContainerAllocator::template rebind< uint32_t >::other > _data_type
Stream base-class, provides common functionality for IStream and OStream.
std::ostream & operator<<(std::ostream &s, const ::std_msgs::Bool_< ContainerAllocator > &v)
::std_msgs::UInt32MultiArray_< std::allocator< void > > UInt32MultiArray
std::shared_ptr< ::std_msgs::UInt32MultiArray_< ContainerAllocator > const > ConstPtr
std::shared_ptr< ::std_msgs::UInt32MultiArray > UInt32MultiArrayPtr
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:13