All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends
Public Types | Public Member Functions | Public Attributes
tk_draft_msgs::SegmentDefinition_< ContainerAllocator > Struct Template Reference

#include <SegmentDefinition.h>

List of all members.

Public Types

typedef ::std_msgs::Header_
< ContainerAllocator > 
_header_type
typedef std::vector< uint8_t,
typename
ContainerAllocator::template
rebind< uint8_t >::other > 
_id1_type
typedef std::vector< uint8_t,
typename
ContainerAllocator::template
rebind< uint8_t >::other > 
_id2_type
typedef std::vector
< ::geometry_msgs::Point_
< ContainerAllocator >
, typename
ContainerAllocator::template
rebind
< ::geometry_msgs::Point_
< ContainerAllocator >
>::other > 
_pointSegEnd_type
typedef std::vector
< ::geometry_msgs::Point_
< ContainerAllocator >
, typename
ContainerAllocator::template
rebind
< ::geometry_msgs::Point_
< ContainerAllocator >
>::other > 
_pointSegStart_type
typedef boost::shared_ptr
< ::tk_draft_msgs::SegmentDefinition_
< ContainerAllocator > const > 
ConstPtr
typedef boost::shared_ptr
< ::tk_draft_msgs::SegmentDefinition_
< ContainerAllocator > > 
Ptr
typedef SegmentDefinition_
< ContainerAllocator > 
Type

Public Member Functions

 SegmentDefinition_ ()
 SegmentDefinition_ (const ContainerAllocator &_alloc)

Public Attributes

boost::shared_ptr< std::map
< std::string, std::string > > 
__connection_header
::std_msgs::Header_
< ContainerAllocator > 
header
std::vector< uint8_t, typename
ContainerAllocator::template
rebind< uint8_t >::other > 
id1
std::vector< uint8_t, typename
ContainerAllocator::template
rebind< uint8_t >::other > 
id2
std::vector
< ::geometry_msgs::Point_
< ContainerAllocator >
, typename
ContainerAllocator::template
rebind
< ::geometry_msgs::Point_
< ContainerAllocator >
>::other > 
pointSegEnd
std::vector
< ::geometry_msgs::Point_
< ContainerAllocator >
, typename
ContainerAllocator::template
rebind
< ::geometry_msgs::Point_
< ContainerAllocator >
>::other > 
pointSegStart

Detailed Description

template<class ContainerAllocator>
struct tk_draft_msgs::SegmentDefinition_< ContainerAllocator >

Definition at line 24 of file SegmentDefinition.h.


Member Typedef Documentation

template<class ContainerAllocator >
typedef ::std_msgs::Header_<ContainerAllocator> tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::_header_type

Definition at line 45 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef std::vector<uint8_t, typename ContainerAllocator::template rebind<uint8_t>::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::_id1_type

Definition at line 48 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef std::vector<uint8_t, typename ContainerAllocator::template rebind<uint8_t>::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::_id2_type

Definition at line 51 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::_pointSegEnd_type

Definition at line 57 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::_pointSegStart_type

Definition at line 54 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::tk_draft_msgs::SegmentDefinition_<ContainerAllocator> const> tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::ConstPtr

Definition at line 62 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::tk_draft_msgs::SegmentDefinition_<ContainerAllocator> > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::Ptr

Definition at line 61 of file SegmentDefinition.h.

template<class ContainerAllocator >
typedef SegmentDefinition_<ContainerAllocator> tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::Type

Definition at line 25 of file SegmentDefinition.h.


Constructor & Destructor Documentation

template<class ContainerAllocator >
tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::SegmentDefinition_ ( ) [inline]

Definition at line 27 of file SegmentDefinition.h.

template<class ContainerAllocator >
tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::SegmentDefinition_ ( const ContainerAllocator &  _alloc) [inline]

Definition at line 36 of file SegmentDefinition.h.


Member Data Documentation

template<class ContainerAllocator >
boost::shared_ptr<std::map<std::string, std::string> > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::__connection_header

Definition at line 63 of file SegmentDefinition.h.

template<class ContainerAllocator >
::std_msgs::Header_<ContainerAllocator> tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::header

Definition at line 46 of file SegmentDefinition.h.

template<class ContainerAllocator >
std::vector<uint8_t, typename ContainerAllocator::template rebind<uint8_t>::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::id1

Definition at line 49 of file SegmentDefinition.h.

template<class ContainerAllocator >
std::vector<uint8_t, typename ContainerAllocator::template rebind<uint8_t>::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::id2

Definition at line 52 of file SegmentDefinition.h.

template<class ContainerAllocator >
std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::pointSegEnd

Definition at line 58 of file SegmentDefinition.h.

template<class ContainerAllocator >
std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > tk_draft_msgs::SegmentDefinition_< ContainerAllocator >::pointSegStart

Definition at line 55 of file SegmentDefinition.h.


The documentation for this struct was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends


tk_draft_msgs
Author(s): Martin Riedel
autogenerated on Mon Nov 11 2013 11:12:57