Go to the documentation of this file.
6 #ifndef SENSOR_MSGS_MESSAGE_MAGNETICFIELD_H
7 #define SENSOR_MSGS_MESSAGE_MAGNETICFIELD_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>
57 typedef std::shared_ptr< ::sensor_msgs::MagneticField_<ContainerAllocator> >
Ptr;
58 typedef std::shared_ptr< ::sensor_msgs::MagneticField_<ContainerAllocator>
const>
ConstPtr;
62 typedef ::sensor_msgs::MagneticField_<std::allocator<void> >
MagneticField;
71 template<
typename ContainerAllocator>
72 std::ostream&
operator<<(std::ostream& s, const ::sensor_msgs::MagneticField_<ContainerAllocator> & v)
82 namespace message_traits
95 template <
class ContainerAllocator>
100 template <
class ContainerAllocator>
105 template <
class ContainerAllocator>
110 template <
class ContainerAllocator>
115 template <
class ContainerAllocator>
120 template <
class ContainerAllocator>
126 template<
class ContainerAllocator>
131 return "2f3b0b43eed0c9501de0fa3ff89a45aa";
134 static const char*
value(const ::sensor_msgs::MagneticField_<ContainerAllocator>&) {
return value(); }
135 static const uint64_t static_value1 = 0x2f3b0b43eed0c950ULL;
136 static const uint64_t static_value2 = 0x1de0fa3ff89a45aaULL;
139 template<
class ContainerAllocator>
144 return "sensor_msgs/MagneticField";
147 static const char*
value(const ::sensor_msgs::MagneticField_<ContainerAllocator>&) {
return value(); }
150 template<
class ContainerAllocator>
155 return " # Measurement of the Magnetic Field vector at a specific location.\n\
157 # If the covariance of the measurement is known, it should be filled in\n\
158 # (if all you know is the variance of each measurement, e.g. from the datasheet,\n\
159 #just put those along the diagonal)\n\
160 # A covariance matrix of all zeros will be interpreted as \"covariance unknown\",\n\
161 # and to use the data a covariance will have to be assumed or gotten from some\n\
165 Header header # timestamp is the time the\n\
166 # field was measured\n\
167 # frame_id is the location and orientation\n\
168 # of the field measurement\n\
170 geometry_msgs/Vector3 magnetic_field # x, y, and z components of the\n\
171 # field vector in Tesla\n\
172 # If your sensor does not output 3 axes,\n\
173 # put NaNs in the components not reported.\n\
175 float64[9] magnetic_field_covariance # Row major about x, y, z axes\n\
176 # 0 is interpreted as variance unknown\n\
177 ================================================================================\n\
178 MSG: std_msgs/Header\n\
179 # Standard metadata for higher-level stamped data types.\n\
180 # This is generally used to communicate timestamped data \n\
181 # in a particular coordinate frame.\n\
183 # sequence ID: consecutively increasing ID \n\
185 #Two-integer timestamp that is expressed as:\n\
186 # * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n\
187 # * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n\
188 # time-handling sugar is provided by the client library\n\
190 #Frame this data is associated with\n\
195 ================================================================================\n\
196 MSG: geometry_msgs/Vector3\n\
197 # This represents a vector in free space. \n\
198 # It is only meant to represent a direction. Therefore, it does not\n\
199 # make sense to apply a translation to it (e.g., when applying a \n\
200 # generic rigid transformation to a Vector3, tf2 will only apply the\n\
201 # rotation). If you want your data to be translatable too, use the\n\
202 # geometry_msgs/Point message instead.\n\
210 static const char*
value(const ::sensor_msgs::MagneticField_<ContainerAllocator>&) {
return value(); }
218 namespace serialization
223 template<
typename Stream,
typename T>
inline static void allInOne(
Stream& stream, T m)
225 stream.next(m.header);
226 stream.next(m.magnetic_field);
227 stream.next(m.magnetic_field_covariance);
238 namespace message_operations
241 template<
class ContainerAllocator>
244 template<
typename Stream>
static void stream(Stream& s,
const std::string&
indent, const ::sensor_msgs::MagneticField_<ContainerAllocator>& v)
249 s <<
indent <<
"magnetic_field: ";
252 s <<
indent <<
"magnetic_field_covariance[]" << std::endl;
253 for (
size_t i = 0; i < v.magnetic_field_covariance.size(); ++i)
255 s <<
indent <<
" magnetic_field_covariance[" << i <<
"]: ";
264 #endif // SENSOR_MSGS_MESSAGE_MAGNETICFIELD_H
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
static void allInOne(Stream &stream, T m)
std::shared_ptr< ::sensor_msgs::MagneticField const > MagneticFieldConstPtr
Templated serialization class. Default implementation provides backwards compatibility with old messa...
MagneticField_(const ContainerAllocator &_alloc)
::sensor_msgs::MagneticField_< std::allocator< void > > MagneticField
static const char * value(const ::sensor_msgs::MagneticField_< ContainerAllocator > &)
static void stream(Stream &s, const std::string &indent, const ::sensor_msgs::MagneticField_< ContainerAllocator > &v)
::std_msgs::Header_< ContainerAllocator > _header_type
static const char * value()
static const char * value(const ::sensor_msgs::MagneticField_< ContainerAllocator > &)
MagneticField_< ContainerAllocator > Type
std::shared_ptr< ::sensor_msgs::MagneticField > MagneticFieldPtr
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...
#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.
std::ostream & operator<<(std::ostream &s, const ::sensor_msgs::BatteryState_< ContainerAllocator > &v)
::geometry_msgs::Vector3_< ContainerAllocator > _magnetic_field_type
static const char * value()
_magnetic_field_type magnetic_field
static const char * value()
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Specialize to provide the md5sum for a message.
Stream base-class, provides common functionality for IStream and OStream.
_magnetic_field_covariance_type magnetic_field_covariance
static const char * value(const ::sensor_msgs::MagneticField_< ContainerAllocator > &)
std::shared_ptr< ::sensor_msgs::MagneticField_< ContainerAllocator > > Ptr
Tools for manipulating sensor_msgs.
std::array< double, 9 > _magnetic_field_covariance_type
std::shared_ptr< ::sensor_msgs::MagneticField_< ContainerAllocator > const > ConstPtr
sick_scan_xd
Author(s): Michael Lehning
, Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:08