#include <std_msgs/Float32MultiArray.h>
#include <std_msgs/Float64MultiArray.h>
#include <std_msgs/Int16MultiArray.h>
#include <std_msgs/Int32MultiArray.h>
#include <std_msgs/Int64MultiArray.h>
#include <std_msgs/Int8MultiArray.h>
#include <std_msgs/UInt16MultiArray.h>
#include <std_msgs/UInt32MultiArray.h>
#include <std_msgs/UInt64MultiArray.h>
#include <std_msgs/UInt8MultiArray.h>
#include <ros/assert.h>
#include <ros/message_traits.h>
#include <ros/serialization.h>
Go to the source code of this file.
Classes | |
struct | ros::serialization::Serializer< std_msgs::VectorMultiArrayAdapter< T, ContainerAllocator > > |
class | std_msgs::VectorMultiArrayAdapter< T, ContainerAllocator > |
Namespaces | |
namespace | ros |
namespace | ros::serialization |
namespace | std_msgs |
Defines | |
#define | STD_MSGS_DEFINE_MULTIARRAY_TRAITS(value_type, msg, static_md5sum1, static_md5sum2) |
#define STD_MSGS_DEFINE_MULTIARRAY_TRAITS | ( | value_type, | |
msg, | |||
static_md5sum1, | |||
static_md5sum2 | |||
) |
Definition at line 82 of file vector_multi_array_adapter.h.