Go to the documentation of this file.
6 #ifndef PCL_MSGS_MESSAGE_POLYGONMESH_H
7 #define PCL_MSGS_MESSAGE_POLYGONMESH_H
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
25 template <
class ContainerAllocator>
47 typedef ::sensor_msgs::PointCloud2_<ContainerAllocator>
_cloud_type;
50 typedef std::vector< ::pcl_msgs::Vertices_<ContainerAllocator> ,
typename ContainerAllocator::template rebind< ::pcl_msgs::Vertices_<ContainerAllocator> >::other >
_polygons_type;
57 typedef std::shared_ptr< ::pcl_msgs::PolygonMesh_<ContainerAllocator> >
Ptr;
58 typedef std::shared_ptr< ::pcl_msgs::PolygonMesh_<ContainerAllocator>
const>
ConstPtr;
62 typedef ::pcl_msgs::PolygonMesh_<std::allocator<void> >
PolygonMesh;
71 template<
typename ContainerAllocator>
72 std::ostream&
operator<<(std::ostream& s, const ::pcl_msgs::PolygonMesh_<ContainerAllocator> & v)
79 template<
typename ContainerAllocator1,
typename ContainerAllocator2>
80 bool operator==(const ::pcl_msgs::PolygonMesh_<ContainerAllocator1> & lhs, const ::pcl_msgs::PolygonMesh_<ContainerAllocator2> & rhs)
82 return lhs.header == rhs.header &&
83 lhs.cloud == rhs.cloud &&
84 lhs.polygons == rhs.polygons;
87 template<
typename ContainerAllocator1,
typename ContainerAllocator2>
88 bool operator!=(const ::pcl_msgs::PolygonMesh_<ContainerAllocator1> & lhs, const ::pcl_msgs::PolygonMesh_<ContainerAllocator2> & rhs)
98 namespace message_traits
105 template <
class ContainerAllocator>
110 template <
class ContainerAllocator>
115 template <
class ContainerAllocator>
120 template <
class ContainerAllocator>
125 template <
class ContainerAllocator>
130 template <
class ContainerAllocator>
136 template<
class ContainerAllocator>
141 return "45a5fc6ad2cde8489600a790acc9a38a";
144 static const char*
value(const ::pcl_msgs::PolygonMesh_<ContainerAllocator>&) {
return value(); }
145 static const uint64_t static_value1 = 0x45a5fc6ad2cde848ULL;
146 static const uint64_t static_value2 = 0x9600a790acc9a38aULL;
149 template<
class ContainerAllocator>
154 return "pcl_msgs/PolygonMesh";
157 static const char*
value(const ::pcl_msgs::PolygonMesh_<ContainerAllocator>&) {
return value(); }
160 template<
class ContainerAllocator>
165 return "# Separate header for the polygonal surface\n"
167 "# Vertices of the mesh as a point cloud\n"
168 "sensor_msgs/PointCloud2 cloud\n"
169 "# List of polygons\n"
170 "Vertices[] polygons\n"
172 "================================================================================\n"
173 "MSG: std_msgs/Header\n"
174 "# Standard metadata for higher-level stamped data types.\n"
175 "# This is generally used to communicate timestamped data \n"
176 "# in a particular coordinate frame.\n"
178 "# sequence ID: consecutively increasing ID \n"
180 "#Two-integer timestamp that is expressed as:\n"
181 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
182 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
183 "# time-handling sugar is provided by the client library\n"
185 "#Frame this data is associated with\n"
188 "================================================================================\n"
189 "MSG: sensor_msgs/PointCloud2\n"
190 "# This message holds a collection of N-dimensional points, which may\n"
191 "# contain additional information such as normals, intensity, etc. The\n"
192 "# point data is stored as a binary blob, its layout described by the\n"
193 "# contents of the \"fields\" array.\n"
195 "# The point cloud data may be organized 2d (image-like) or 1d\n"
196 "# (unordered). Point clouds organized as 2d images may be produced by\n"
197 "# camera depth sensors such as stereo or time-of-flight.\n"
199 "# Time of sensor data acquisition, and the coordinate frame ID (for 3d\n"
203 "# 2D structure of the point cloud. If the cloud is unordered, height is\n"
204 "# 1 and width is the length of the point cloud.\n"
208 "# Describes the channels and their layout in the binary data blob.\n"
209 "PointField[] fields\n"
211 "bool is_bigendian # Is this data bigendian?\n"
212 "uint32 point_step # Length of a point in bytes\n"
213 "uint32 row_step # Length of a row in bytes\n"
214 "uint8[] data # Actual point data, size is (row_step*height)\n"
216 "bool is_dense # True if there are no invalid points\n"
218 "================================================================================\n"
219 "MSG: sensor_msgs/PointField\n"
220 "# This message holds the description of one point entry in the\n"
221 "# PointCloud2 message format.\n"
228 "uint8 FLOAT32 = 7\n"
229 "uint8 FLOAT64 = 8\n"
231 "string name # Name of field\n"
232 "uint32 offset # Offset from start of point struct\n"
233 "uint8 datatype # Datatype enumeration, see above\n"
234 "uint32 count # How many elements in the field\n"
236 "================================================================================\n"
237 "MSG: pcl_msgs/Vertices\n"
238 "# List of point indices\n"
239 "uint32[] vertices\n"
243 static const char*
value(const ::pcl_msgs::PolygonMesh_<ContainerAllocator>&) {
return value(); }
251 namespace serialization
256 template<
typename Stream,
typename T>
inline static void allInOne(
Stream& stream, T m)
258 stream.next(m.header);
259 stream.next(m.cloud);
260 stream.next(m.polygons);
271 namespace message_operations
274 template<
class ContainerAllocator>
277 template<
typename Stream>
static void stream(Stream& s,
const std::string&
indent, const ::pcl_msgs::PolygonMesh_<ContainerAllocator>& v)
285 s <<
indent <<
"polygons[]" << std::endl;
286 for (
size_t i = 0; i < v.polygons.size(); ++i)
288 s <<
indent <<
" polygons[" << i <<
"]: ";
299 #endif // PCL_MSGS_MESSAGE_POLYGONMESH_H
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
static const char * value(const ::pcl_msgs::PolygonMesh_< ContainerAllocator > &)
Templated serialization class. Default implementation provides backwards compatibility with old messa...
static const char * value()
static void stream(Stream &s, const std::string &indent, const M &value)
A fixed-size datatype is one whose size is constant, i.e. it has no variable-length arrays or strings...
std::ostream & operator<<(std::ostream &s, const ::pcl_msgs::ModelCoefficients_< ContainerAllocator > &v)
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
Specialize to provide the datatype for a message.
Specialize to provide the definition for a message.
static void allInOne(Stream &stream, T m)
std::shared_ptr< ::pcl_msgs::PolygonMesh_< ContainerAllocator > > Ptr
static const char * value()
std::shared_ptr< ::pcl_msgs::PolygonMesh_< ContainerAllocator > const > ConstPtr
static const char * value(const ::pcl_msgs::PolygonMesh_< ContainerAllocator > &)
bool operator==(const ::pcl_msgs::ModelCoefficients_< ContainerAllocator1 > &lhs, const ::pcl_msgs::ModelCoefficients_< ContainerAllocator2 > &rhs)
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Specialize to provide the md5sum for a message.
::pcl_msgs::PolygonMesh_< std::allocator< void > > PolygonMesh
::std_msgs::Header_< ContainerAllocator > _header_type
::sensor_msgs::PointCloud2_< ContainerAllocator > _cloud_type
PolygonMesh_(const ContainerAllocator &_alloc)
std::vector< ::pcl_msgs::Vertices_< ContainerAllocator >, typename ContainerAllocator::template rebind< ::pcl_msgs::Vertices_< ContainerAllocator > >::other > _polygons_type
static const char * value(const ::pcl_msgs::PolygonMesh_< ContainerAllocator > &)
Stream base-class, provides common functionality for IStream and OStream.
PolygonMesh_< ContainerAllocator > Type
bool operator!=(const ::pcl_msgs::ModelCoefficients_< ContainerAllocator1 > &lhs, const ::pcl_msgs::ModelCoefficients_< ContainerAllocator2 > &rhs)
static const char * value()
std::shared_ptr< ::pcl_msgs::PolygonMesh const > PolygonMeshConstPtr
std::shared_ptr< ::pcl_msgs::PolygonMesh > PolygonMeshPtr
static void stream(Stream &s, const std::string &indent, const ::pcl_msgs::PolygonMesh_< ContainerAllocator > &v)
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:09