Go to the documentation of this file.
6 #ifndef SICK_SCAN_MESSAGE_SICKIMU_H
7 #define SICK_SCAN_MESSAGE_SICKIMU_H
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
24 template <
class ContainerAllocator>
52 typedef ::sensor_msgs::Imu_<ContainerAllocator>
_Imu_type;
71 typedef std::shared_ptr< ::sick_scan_xd::SickImu_<ContainerAllocator> >
Ptr;
72 typedef std::shared_ptr< ::sick_scan_xd::SickImu_<ContainerAllocator>
const>
ConstPtr;
76 typedef ::sick_scan_xd::SickImu_<std::allocator<void> >
SickImu;
78 typedef std::shared_ptr< ::sick_scan_xd::SickImu >
SickImuPtr;
85 template<
typename ContainerAllocator>
86 std::ostream&
operator<<(std::ostream& s, const ::sick_scan_xd::SickImu_<ContainerAllocator> & v)
96 namespace message_traits
109 template <
class ContainerAllocator>
114 template <
class ContainerAllocator>
119 template <
class ContainerAllocator>
124 template <
class ContainerAllocator>
129 template <
class ContainerAllocator>
134 template <
class ContainerAllocator>
140 template<
class ContainerAllocator>
145 return "136303711a1d592affd8713883708711";
148 static const char*
value(const ::sick_scan_xd::SickImu_<ContainerAllocator>&) {
return value(); }
149 static const uint64_t static_value1 = 0x136303711a1d592aULL;
150 static const uint64_t static_value2 = 0xffd8713883708711ULL;
153 template<
class ContainerAllocator>
158 return "sick_scan/SickImu";
161 static const char*
value(const ::sick_scan_xd::SickImu_<ContainerAllocator>&) {
return value(); }
164 template<
class ContainerAllocator>
169 return "# This message contains the IMU data of a Sick laser scanner as an IMU message.\n"
170 "# The ticks correspond to the internal time stamps of the laser scanner and increase linearly with time, the tickcounter overflows.\n"
171 "# The quaternion_accuracy has the unit rad.\n"
172 "# The accuracy measures for Lienar acceleration and angular velocity are abitre values, where higher values are better.\n"
177 "sensor_msgs/Imu Imu\n"
181 "# timestamp Ticks from laser scanner\n"
183 "float32 quaternion_accuracy\n"
184 "#quaternion accuracy in rad\n"
186 "uint8 angular_velocity_reliability\n"
187 "#angular velocity reliability 0 low 255 high, value should be over 3\n"
189 "uint8 linear_acceleration_reliability\n"
190 "#linear acceleration reliability 0 low 255 high, value should be over 3\n"
192 "================================================================================\n"
193 "MSG: std_msgs/Header\n"
194 "# Standard metadata for higher-level stamped data types.\n"
195 "# This is generally used to communicate timestamped data \n"
196 "# in a particular coordinate frame.\n"
198 "# sequence ID: consecutively increasing ID \n"
200 "#Two-integer timestamp that is expressed as:\n"
201 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
202 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
203 "# time-handling sugar is provided by the client library\n"
205 "#Frame this data is associated with\n"
208 "================================================================================\n"
209 "MSG: sensor_msgs/Imu\n"
210 "# This is a message to hold data from an IMU (Inertial Measurement Unit)\n"
212 "# Accelerations should be in m/s^2 (not in g's), and rotational velocity should be in rad/sec\n"
214 "# If the covariance of the measurement is known, it should be filled in (if all you know is the \n"
215 "# variance of each measurement, e.g. from the datasheet, just put those along the diagonal)\n"
216 "# A covariance matrix of all zeros will be interpreted as \"covariance unknown\", and to use the\n"
217 "# data a covariance will have to be assumed or gotten from some other source\n"
219 "# If you have no estimate for one of the data elements (e.g. your IMU doesn't produce an orientation \n"
220 "# estimate), please set element 0 of the associated covariance matrix to -1\n"
221 "# If you are interpreting this message, please check for a value of -1 in the first element of each \n"
222 "# covariance matrix, and disregard the associated estimate.\n"
226 "geometry_msgs/Quaternion orientation\n"
227 "float64[9] orientation_covariance # Row major about x, y, z axes\n"
229 "geometry_msgs/Vector3 angular_velocity\n"
230 "float64[9] angular_velocity_covariance # Row major about x, y, z axes\n"
232 "geometry_msgs/Vector3 linear_acceleration\n"
233 "float64[9] linear_acceleration_covariance # Row major x, y z \n"
235 "================================================================================\n"
236 "MSG: geometry_msgs/Quaternion\n"
237 "# This represents an orientation in free space in quaternion form.\n"
244 "================================================================================\n"
245 "MSG: geometry_msgs/Vector3\n"
246 "# This represents a vector in free space. \n"
247 "# It is only meant to represent a direction. Therefore, it does not\n"
248 "# make sense to apply a translation to it (e.g., when applying a \n"
249 "# generic rigid transformation to a Vector3, tf2 will only apply the\n"
250 "# rotation). If you want your data to be translatable too, use the\n"
251 "# geometry_msgs/Point message instead.\n"
259 static const char*
value(const ::sick_scan_xd::SickImu_<ContainerAllocator>&) {
return value(); }
267 namespace serialization
272 template<
typename Stream,
typename T>
inline static void allInOne(
Stream& stream, T m)
274 stream.next(m.header);
276 stream.next(m.ticks);
277 stream.next(m.quaternion_accuracy);
278 stream.next(m.angular_velocity_reliability);
279 stream.next(m.linear_acceleration_reliability);
290 namespace message_operations
293 template<
class ContainerAllocator>
296 template<
typename Stream>
static void stream(Stream& s,
const std::string&
indent, const ::sick_scan_xd::SickImu_<ContainerAllocator>& v)
306 s <<
indent <<
"quaternion_accuracy: ";
308 s <<
indent <<
"angular_velocity_reliability: ";
310 s <<
indent <<
"linear_acceleration_reliability: ";
318 #endif // SICK_SCAN_MESSAGE_SICKIMU_H
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
std::ostream & operator<<(std::ostream &s, const ::sick_scan_xd::ColaMsgSrvRequest_< ContainerAllocator > &v)
std::shared_ptr< ::sick_scan_xd::SickImu > SickImuPtr
Templated serialization class. Default implementation provides backwards compatibility with old messa...
SickImu_(const ContainerAllocator &_alloc)
::sensor_msgs::Imu_< ContainerAllocator > _Imu_type
static void allInOne(Stream &stream, T m)
static const char * value()
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...
_quaternion_accuracy_type quaternion_accuracy
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
_angular_velocity_reliability_type angular_velocity_reliability
Specialize to provide the datatype for a message.
Specialize to provide the definition for a message.
static const char * value(const ::sick_scan_xd::SickImu_< ContainerAllocator > &)
std::shared_ptr< ::sick_scan_xd::SickImu const > SickImuConstPtr
uint8_t _angular_velocity_reliability_type
static const char * value()
static const char * value(const ::sick_scan_xd::SickImu_< ContainerAllocator > &)
SickImu_< ContainerAllocator > Type
std::shared_ptr< ::sick_scan_xd::SickImu_< ContainerAllocator > const > ConstPtr
::sick_scan_xd::SickImu_< std::allocator< void > > SickImu
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Specialize to provide the md5sum for a message.
static void stream(Stream &s, const std::string &indent, const ::sick_scan_xd::SickImu_< ContainerAllocator > &v)
Stream base-class, provides common functionality for IStream and OStream.
uint8_t _linear_acceleration_reliability_type
static const char * value(const ::sick_scan_xd::SickImu_< ContainerAllocator > &)
_linear_acceleration_reliability_type linear_acceleration_reliability
::std_msgs::Header_< ContainerAllocator > _header_type
std::shared_ptr< ::sick_scan_xd::SickImu_< ContainerAllocator > > Ptr
float _quaternion_accuracy_type
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:11