Public Types | Public Member Functions | Static Public Member Functions | Static Private Member Functions | List of all members
roslib::Header_< ContainerAllocator > Struct Template Reference

#include <header_deprecated_def.h>

Inheritance diagram for roslib::Header_< ContainerAllocator >:
Inheritance graph
[legend]

Public Types

typedef boost::shared_ptr< ::roslib::Header_< ContainerAllocator > const > ConstPtr
 
typedef boost::shared_ptr< ::roslib::Header_< ContainerAllocator > > Ptr
 
typedef Header_< ContainerAllocator > Type
 
- Public Types inherited from std_msgs::Header_< ContainerAllocator >
typedef std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _frame_id_type
 
typedef uint32_t _seq_type
 
typedef rs2rosinternal::Time _stamp_type
 
typedef std::shared_ptr< ::std_msgs::Header_< ContainerAllocator > const > ConstPtr
 
typedef std::shared_ptr< ::std_msgs::Header_< ContainerAllocator > > Ptr
 
typedef Header_< ContainerAllocator > Type
 

Public Member Functions

const std::string __getDataType () const
 
const std::string __getMD5Sum () const
 
const std::string __getMessageDefinition () const
 
virtual uint8_tdeserialize (uint8_t *read_ptr)
 
ROS_DEPRECATED Header_ ()
 
ROS_DEPRECATED Header_ (const ContainerAllocator &_alloc)
 
ROS_DEPRECATED Header_ (const std_msgs::Header_< ContainerAllocator > &rhs)
 
ROS_DEPRECATED operator std_msgs::Header_< ContainerAllocator > ()
 
ROS_DEPRECATED Typeoperator= (const std_msgs::Header_< ContainerAllocator > &rhs)
 
virtual uint32_t serializationLength () const
 
virtual uint8_tserialize (uint8_t *write_ptr, uint32_t seq) const
 
- Public Member Functions inherited from std_msgs::Header_< ContainerAllocator >
 Header_ ()
 
 Header_ (const ContainerAllocator &_alloc)
 

Static Public Member Functions

static const std::string __s_getDataType ()
 
static const std::string __s_getMD5Sum ()
 
static const std::string __s_getMessageDefinition ()
 

Static Private Member Functions

static const char * __s_getDataType_ ()
 
static const char * __s_getMD5Sum_ ()
 
static const char * __s_getMessageDefinition_ ()
 

Additional Inherited Members

- Public Attributes inherited from std_msgs::Header_< ContainerAllocator >
_frame_id_type frame_id
 
_seq_type seq
 
_stamp_type stamp
 

Detailed Description

template<class ContainerAllocator>
struct roslib::Header_< ContainerAllocator >

Definition at line 35 of file header_deprecated_def.h.

Member Typedef Documentation

template<class ContainerAllocator >
typedef boost::shared_ptr< ::roslib::Header_<ContainerAllocator> const> roslib::Header_< ContainerAllocator >::ConstPtr

Definition at line 137 of file header_deprecated_def.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::roslib::Header_<ContainerAllocator> > roslib::Header_< ContainerAllocator >::Ptr

Definition at line 136 of file header_deprecated_def.h.

template<class ContainerAllocator >
typedef Header_<ContainerAllocator> roslib::Header_< ContainerAllocator >::Type

Definition at line 37 of file header_deprecated_def.h.

Constructor & Destructor Documentation

template<class ContainerAllocator >
ROS_DEPRECATED roslib::Header_< ContainerAllocator >::Header_ ( )
inline

Definition at line 39 of file header_deprecated_def.h.

template<class ContainerAllocator >
ROS_DEPRECATED roslib::Header_< ContainerAllocator >::Header_ ( const ContainerAllocator &  _alloc)
inline

Definition at line 43 of file header_deprecated_def.h.

template<class ContainerAllocator >
ROS_DEPRECATED roslib::Header_< ContainerAllocator >::Header_ ( const std_msgs::Header_< ContainerAllocator > &  rhs)
inline

Definition at line 48 of file header_deprecated_def.h.

Member Function Documentation

template<class ContainerAllocator >
const std::string roslib::Header_< ContainerAllocator >::__getDataType ( ) const
inline

Definition at line 77 of file header_deprecated_def.h.

template<class ContainerAllocator >
const std::string roslib::Header_< ContainerAllocator >::__getMD5Sum ( ) const
inline

Definition at line 84 of file header_deprecated_def.h.

template<class ContainerAllocator >
const std::string roslib::Header_< ContainerAllocator >::__getMessageDefinition ( ) const
inline

Definition at line 107 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const std::string roslib::Header_< ContainerAllocator >::__s_getDataType ( )
inlinestatic

Definition at line 75 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const char* roslib::Header_< ContainerAllocator >::__s_getDataType_ ( )
inlinestaticprivate

Definition at line 73 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const std::string roslib::Header_< ContainerAllocator >::__s_getMD5Sum ( )
inlinestatic

Definition at line 82 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const char* roslib::Header_< ContainerAllocator >::__s_getMD5Sum_ ( )
inlinestaticprivate

Definition at line 80 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const std::string roslib::Header_< ContainerAllocator >::__s_getMessageDefinition ( )
inlinestatic

Definition at line 105 of file header_deprecated_def.h.

template<class ContainerAllocator >
static const char* roslib::Header_< ContainerAllocator >::__s_getMessageDefinition_ ( )
inlinestaticprivate

Definition at line 87 of file header_deprecated_def.h.

template<class ContainerAllocator >
virtual uint8_t* roslib::Header_< ContainerAllocator >::deserialize ( uint8_t read_ptr)
inlinevirtual

Definition at line 118 of file header_deprecated_def.h.

template<class ContainerAllocator >
ROS_DEPRECATED roslib::Header_< ContainerAllocator >::operator std_msgs::Header_< ContainerAllocator > ( )
inline

Definition at line 63 of file header_deprecated_def.h.

template<class ContainerAllocator >
ROS_DEPRECATED Type& roslib::Header_< ContainerAllocator >::operator= ( const std_msgs::Header_< ContainerAllocator > &  rhs)
inline

Definition at line 53 of file header_deprecated_def.h.

template<class ContainerAllocator >
virtual uint32_t roslib::Header_< ContainerAllocator >::serializationLength ( ) const
inlinevirtual

Definition at line 127 of file header_deprecated_def.h.

template<class ContainerAllocator >
virtual uint8_t* roslib::Header_< ContainerAllocator >::serialize ( uint8_t write_ptr,
uint32_t  seq 
) const
inlinevirtual

Definition at line 109 of file header_deprecated_def.h.


The documentation for this struct was generated from the following file:


librealsense2
Author(s): Sergey Dorodnicov , Doron Hirshberg , Mark Horn , Reagan Lopez , Itay Carpis
autogenerated on Mon May 3 2021 02:50:40