header_deprecated_def.h
Go to the documentation of this file.
1 #include "sick_scan/sick_scan_base.h" /* Base definitions included in all header files, added by add_sick_scan_base_header.py. Do not edit this line. */
2 /*
3  * Copyright (C) 2009, Willow Garage, Inc.
4  *
5  * Redistribution and use in source and binary forms, with or without
6  * modification, are permitted provided that the following conditions are met:
7  * * Redistributions of source code must retain the above copyright notice,
8  * this list of conditions and the following disclaimer.
9  * * Redistributions in binary form must reproduce the above copyright
10  * notice, this list of conditions and the following disclaimer in the
11  * documentation and/or other materials provided with the distribution.
12  * * Neither the names of Willow Garage, Inc. nor the names of its
13  * contributors may be used to endorse or promote products derived from
14  * this software without specific prior written permission.
15  *
16  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
17  * AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
18  * IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE
19  * ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT OWNER OR CONTRIBUTORS BE
20  * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
21  * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF
22  * SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS
23  * INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN
24  * CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE)
25  * ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
26  * POSSIBILITY OF SUCH DAMAGE.
27  */
28 
29 #ifndef STD_MSGS_INCLUDING_HEADER_DEPRECATED_DEF
30 #error("Do not include this file directly. Instead, include std_msgs/Header.h")
31 #endif
32 
33 namespace roslib
34 {
35 template <class ContainerAllocator>
36 struct Header_ : public std_msgs::Header_<ContainerAllocator>
37 {
38  typedef Header_<ContainerAllocator> Type;
39 
41  {
42  }
43 
44  ROS_DEPRECATED Header_(const ContainerAllocator& _alloc)
45  : std_msgs::Header_<ContainerAllocator>(_alloc)
46  {
47  }
48 
50  {
51  *this = rhs;
52  }
53 
55  {
56  if (this == &rhs)
57  return *this;
58  this->seq = rhs.seq;
59  this->stamp = rhs.stamp;
60  this->frame_id = rhs.frame_id;
61  return *this;
62  }
63 
65  {
67  h.seq = this->seq;
68  h.stamp = this->stamp;
69  h.frame_id = this->frame_id;
70  return h;
71  }
72 
73 private:
74  static const char* __s_getDataType_() { return "roslib/Header"; }
75 public:
76  static const std::string __s_getDataType() { return __s_getDataType_(); }
77 
78  const std::string __getDataType() const { return __s_getDataType_(); }
79 
80 private:
81  static const char* __s_getMD5Sum_() { return "2176decaecbce78abc3b96ef049fabed"; }
82 public:
83  static const std::string __s_getMD5Sum() { return __s_getMD5Sum_(); }
84 
85  const std::string __getMD5Sum() const { return __s_getMD5Sum_(); }
86 
87 private:
88  static const char* __s_getMessageDefinition_() { return "# Standard metadata for higher-level stamped data types.\n\
89 # This is generally used to communicate timestamped data \n\
90 # in a particular coordinate frame.\n\
91 # \n\
92 # sequence ID: consecutively increasing ID \n\
93 uint32 seq\n\
94 #Two-integer timestamp that is expressed as:\n\
95 # * stamp.secs: seconds (stamp_secs) since epoch\n\
96 # * stamp.nsecs: nanoseconds since stamp_secs\n\
97 # time-handling sugar is provided by the client library\n\
98 time stamp\n\
99 #Frame this data is associated with\n\
100 # 0: no frame\n\
101 # 1: global frame\n\
102 string frame_id\n\
103 \n\
104 "; }
105 public:
106  static const std::string __s_getMessageDefinition() { return __s_getMessageDefinition_(); }
107 
108  const std::string __getMessageDefinition() const { return __s_getMessageDefinition_(); }
109 
110  virtual uint8_t *serialize(uint8_t *write_ptr, uint32_t seq) const
111  {
112  ros::serialization::OStream stream(write_ptr, 1000000000);
113  ros::serialization::serialize(stream, this->seq);
114  ros::serialization::serialize(stream, this->stamp);
115  ros::serialization::serialize(stream, this->frame_id);
116  return stream.getData();
117  }
118 
119  virtual uint8_t *deserialize(uint8_t *read_ptr)
120  {
121  ros::serialization::IStream stream(read_ptr, 1000000000);
122  ros::serialization::deserialize(stream, this->seq);
123  ros::serialization::deserialize(stream, this->stamp);
124  ros::serialization::deserialize(stream, this->frame_id);
125  return stream.getData();
126  }
127 
128  virtual uint32_t serializationLength() const
129  {
130  uint32_t size = 0;
131  size += ros::serialization::serializationLength(this->seq);
132  size += ros::serialization::serializationLength(this->stamp);
133  size += ros::serialization::serializationLength(this->frame_id);
134  return size;
135  }
136 
137  typedef std::shared_ptr< ::roslib::Header_<ContainerAllocator> > Ptr;
138  typedef std::shared_ptr< ::roslib::Header_<ContainerAllocator> const> ConstPtr;
139 }; // struct Header
140 typedef ::roslib::Header_<std::allocator<void> > Header;
141 
142 typedef std::shared_ptr< ::roslib::Header> HeaderPtr;
143 typedef std::shared_ptr< ::roslib::Header const> HeaderConstPtr;
144 
145 
146 template<typename ContainerAllocator>
147 std::ostream& operator<<(std::ostream& s, const ::roslib::Header_<ContainerAllocator> & v)
148 {
150  return s;}
151 
152 } // namespace roslib
153 
154 namespace roswrap
155 {
156 namespace message_traits
157 {
158 template<class ContainerAllocator>
159 struct MD5Sum< ::roslib::Header_<ContainerAllocator> > {
160  static const char* value()
161  {
162  return "2176decaecbce78abc3b96ef049fabed";
163  }
164 
165  static const char* value(const ::roslib::Header_<ContainerAllocator> &) { return value(); }
166  static const uint64_t static_value1 = 0x2176decaecbce78aULL;
167  static const uint64_t static_value2 = 0xbc3b96ef049fabedULL;
168 };
169 
170 template<class ContainerAllocator>
171 struct DataType< ::roslib::Header_<ContainerAllocator> > {
172  static const char* value()
173  {
174  return "roslib/Header";
175  }
176 
177  static const char* value(const ::roslib::Header_<ContainerAllocator> &) { return value(); }
178 };
179 
180 template<class ContainerAllocator>
181 struct Definition< ::roslib::Header_<ContainerAllocator> > {
182  static const char* value()
183  {
184  return "# Standard metadata for higher-level stamped data types.\n\
185 # This is generally used to communicate timestamped data \n\
186 # in a particular coordinate frame.\n\
187 # \n\
188 # sequence ID: consecutively increasing ID \n\
189 uint32 seq\n\
190 #Two-integer timestamp that is expressed as:\n\
191 # * stamp.secs: seconds (stamp_secs) since epoch\n\
192 # * stamp.nsecs: nanoseconds since stamp_secs\n\
193 # time-handling sugar is provided by the client library\n\
194 time stamp\n\
195 #Frame this data is associated with\n\
196 # 0: no frame\n\
197 # 1: global frame\n\
198 string frame_id\n\
199 \n\
200 ";
201  }
202 
203  static const char* value(const ::roslib::Header_<ContainerAllocator> &) { return value(); }
204 };
205 
206 } // namespace message_traits
207 } // namespace roswrap
208 
209 namespace roswrap
210 {
211 namespace serialization
212 {
213 
214 template<class ContainerAllocator> struct Serializer< ::roslib::Header_<ContainerAllocator> >
215 {
216  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
217  {
218  stream.next(m.seq);
219  stream.next(m.stamp);
220  stream.next(m.frame_id);
221  }
222 
224 }; // struct Header_
225 } // namespace serialization
226 } // namespace roswrap
227 
228 namespace roswrap
229 {
230 namespace message_operations
231 {
232 
233 template<class ContainerAllocator>
234 struct Printer< ::roslib::Header_<ContainerAllocator> >
235 {
236  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::roslib::Header_<ContainerAllocator> & v)
237  {
238  s << indent << "seq: ";
239  Printer<uint32_t>::stream(s, indent + " ", v.seq);
240  s << indent << "stamp: ";
241  Printer<ros::Time>::stream(s, indent + " ", v.stamp);
242  s << indent << "frame_id: ";
243  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.frame_id);
244  }
245 };
246 
247 
248 } // namespace message_operations
249 } // namespace roswrap
250 
std_msgs::Header_::stamp
_stamp_type stamp
Definition: Header.h:45
roslib::Header_::__s_getDataType
static const std::string __s_getDataType()
ros::serialization::OStream
roswrap::message_operations::Printer< ::roslib::Header_< ContainerAllocator > >::stream
static void stream(Stream &s, const std::string &indent, const ::roslib::Header_< ContainerAllocator > &v)
Definition: header_deprecated_def.h:236
multiscan_pcap_player.indent
indent
Definition: multiscan_pcap_player.py:252
ros::serialization::deserialize
void deserialize(Stream &stream, boost::array< T, N > &t)
roswrap::serialization::Serializer
Templated serialization class. Default implementation provides backwards compatibility with old messa...
Definition: serialization.h:120
roslib::Header_::Header_
ROS_DEPRECATED Header_()
s
XmlRpcServer s
roslib::Header_::__s_getMessageDefinition_
static const char * __s_getMessageDefinition_()
ros::serialization::serializationLength
uint32_t serializationLength(const boost::array< T, N > &t)
roswrap::message_operations::Printer::stream
static void stream(Stream &s, const std::string &indent, const M &value)
Definition: message_operations.h:43
roslib::Header_::__s_getMD5Sum
static const std::string __s_getMD5Sum()
roslib::Header_::__s_getMessageDefinition
static const std::string __s_getMessageDefinition()
ros::serialization::IStream
ros::message_operations::Printer
roslib::Header_::Ptr
boost::shared_ptr< ::roslib::Header_< ContainerAllocator > > Ptr
ROS_DEPRECATED
#define ROS_DEPRECATED
Definition: macros.h:39
roswrap::serialization::Serializer< ::roslib::Header_< ContainerAllocator > >::ROS_DECLARE_ALLINONE_SERIALIZER
ROS_DECLARE_ALLINONE_SERIALIZER
Definition: header_deprecated_def.h:223
roswrap::message_traits::DataType
Specialize to provide the datatype for a message.
Definition: message_traits.h:135
roswrap::message_traits::MD5Sum< ::roslib::Header_< ContainerAllocator > >::value
static const char * value(const ::roslib::Header_< ContainerAllocator > &)
Definition: header_deprecated_def.h:165
roslib::operator<<
std::ostream & operator<<(std::ostream &s, const ::roslib::Header_< ContainerAllocator > &v)
Definition: header_deprecated_def.h:147
roswrap::message_traits::Definition
Specialize to provide the definition for a message.
Definition: message_traits.h:152
roswrap::serialization::Serializer< ::roslib::Header_< ContainerAllocator > >::allInOne
static void allInOne(Stream &stream, T m)
Definition: header_deprecated_def.h:216
roslib::Header_::deserialize
virtual uint8_t * deserialize(uint8_t *read_ptr)
roswrap::message_traits::DataType< ::roslib::Header_< ContainerAllocator > >::value
static const char * value()
Definition: header_deprecated_def.h:172
std_msgs
roslib::Header
::roslib::Header_< std::allocator< void > > Header
roslib::Header_::__s_getMD5Sum_
static const char * __s_getMD5Sum_()
roslib::Header_::__s_getDataType_
static const char * __s_getDataType_()
roswrap::message_traits::Definition< ::roslib::Header_< ContainerAllocator > >::value
static const char * value(const ::roslib::Header_< ContainerAllocator > &)
Definition: header_deprecated_def.h:203
std_msgs::Header_::seq
_seq_type seq
Definition: Header.h:42
roslib::Header_::__getMessageDefinition
const std::string __getMessageDefinition() const
roswrap::message_traits::MD5Sum< ::roslib::Header_< ContainerAllocator > >::value
static const char * value()
Definition: header_deprecated_def.h:160
roswrap
Definition: param_modi.cpp:41
roswrap::message_operations::Printer
Definition: message_operations.h:40
std_msgs::Header_
Definition: Header.h:23
roslib::Header_::__getMD5Sum
const std::string __getMD5Sum() const
roslib::Header_
Definition: header_deprecated_def.h:36
roslib::Header_::serialize
virtual uint8_t * serialize(uint8_t *write_ptr, uint32_t seq) const
roswrap::message_traits::MD5Sum
Specialize to provide the md5sum for a message.
Definition: message_traits.h:118
std_msgs::Header_::frame_id
_frame_id_type frame_id
Definition: Header.h:48
roslib::Header_::__getDataType
const std::string __getDataType() const
roslib::Header_::ConstPtr
boost::shared_ptr< ::roslib::Header_< ContainerAllocator > const > ConstPtr
roslib::Header_::Type
Header_< ContainerAllocator > Type
sick_scan_base.h
roswrap::serialization::Stream
Stream base-class, provides common functionality for IStream and OStream.
Definition: serialization.h:705
roslib
roslib::Header_::operator=
ROS_DEPRECATED Type & operator=(const std_msgs::Header_< ContainerAllocator > &rhs)
ros::serialization::serialize
void serialize(Stream &stream, const boost::array< T, N > &t)
roslib::HeaderConstPtr
boost::shared_ptr< ::roslib::Header const > HeaderConstPtr
roslib::Header_::serializationLength
virtual uint32_t serializationLength() const
roswrap::message_traits::DataType< ::roslib::Header_< ContainerAllocator > >::value
static const char * value(const ::roslib::Header_< ContainerAllocator > &)
Definition: header_deprecated_def.h:177
roswrap::message_traits::Definition< ::roslib::Header_< ContainerAllocator > >::value
static const char * value()
Definition: header_deprecated_def.h:182
roslib::HeaderPtr
boost::shared_ptr< ::roslib::Header > HeaderPtr


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:08