Public Types | Public Member Functions | Public Attributes
sr_robot_msgs::EthercatDebug_< ContainerAllocator > Struct Template Reference

#include <EthercatDebug.h>

List of all members.

Public Types

typedef ::std_msgs::Header_
< ContainerAllocator > 
_header_type
typedef int16_t _idle_time_us_type
typedef std::vector< int16_t,
typename
ContainerAllocator::template
rebind< int16_t >::other > 
_motor_data_packet_misc_type
typedef std::vector< int16_t,
typename
ContainerAllocator::template
rebind< int16_t >::other > 
_motor_data_packet_torque_type
typedef
::sr_robot_msgs::FromMotorDataType_
< ContainerAllocator > 
_motor_data_type_type
typedef std::vector< int16_t,
typename
ContainerAllocator::template
rebind< int16_t >::other > 
_sensors_type
typedef int32_t _tactile_data_type_type
typedef int16_t _tactile_data_valid_type
typedef std::vector< int16_t,
typename
ContainerAllocator::template
rebind< int16_t >::other > 
_tactile_type
typedef int32_t _which_motor_data_arrived_type
typedef int32_t _which_motor_data_had_errors_type
typedef int16_t _which_motors_type
typedef boost::shared_ptr
< ::sr_robot_msgs::EthercatDebug_
< ContainerAllocator > const > 
ConstPtr
typedef boost::shared_ptr
< ::sr_robot_msgs::EthercatDebug_
< ContainerAllocator > > 
Ptr
typedef EthercatDebug_
< ContainerAllocator > 
Type

Public Member Functions

 EthercatDebug_ ()
 EthercatDebug_ (const ContainerAllocator &_alloc)

Public Attributes

boost::shared_ptr< std::map
< std::string, std::string > > 
__connection_header
::std_msgs::Header_
< ContainerAllocator > 
header
int16_t idle_time_us
std::vector< int16_t, typename
ContainerAllocator::template
rebind< int16_t >::other > 
motor_data_packet_misc
std::vector< int16_t, typename
ContainerAllocator::template
rebind< int16_t >::other > 
motor_data_packet_torque
::sr_robot_msgs::FromMotorDataType_
< ContainerAllocator > 
motor_data_type
std::vector< int16_t, typename
ContainerAllocator::template
rebind< int16_t >::other > 
sensors
std::vector< int16_t, typename
ContainerAllocator::template
rebind< int16_t >::other > 
tactile
int32_t tactile_data_type
int16_t tactile_data_valid
int32_t which_motor_data_arrived
int32_t which_motor_data_had_errors
int16_t which_motors

Detailed Description

template<class ContainerAllocator>
struct sr_robot_msgs::EthercatDebug_< ContainerAllocator >

Definition at line 23 of file EthercatDebug.h.


Member Typedef Documentation

template<class ContainerAllocator >
typedef ::std_msgs::Header_<ContainerAllocator> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_header_type

Definition at line 58 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_idle_time_us_type

Definition at line 91 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_motor_data_packet_misc_type

Definition at line 79 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_motor_data_packet_torque_type

Definition at line 76 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef ::sr_robot_msgs::FromMotorDataType_<ContainerAllocator> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_motor_data_type_type

Definition at line 64 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_sensors_type

Definition at line 61 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_tactile_data_type_type

Definition at line 82 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_tactile_data_valid_type

Definition at line 85 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_tactile_type

Definition at line 88 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_which_motor_data_arrived_type

Definition at line 70 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_which_motor_data_had_errors_type

Definition at line 73 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::_which_motors_type

Definition at line 67 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::sr_robot_msgs::EthercatDebug_<ContainerAllocator> const> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::ConstPtr

Definition at line 96 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::sr_robot_msgs::EthercatDebug_<ContainerAllocator> > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::Ptr

Definition at line 95 of file EthercatDebug.h.

template<class ContainerAllocator >
typedef EthercatDebug_<ContainerAllocator> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::Type

Definition at line 24 of file EthercatDebug.h.


Constructor & Destructor Documentation

template<class ContainerAllocator >
sr_robot_msgs::EthercatDebug_< ContainerAllocator >::EthercatDebug_ ( ) [inline]

Definition at line 26 of file EthercatDebug.h.

template<class ContainerAllocator >
sr_robot_msgs::EthercatDebug_< ContainerAllocator >::EthercatDebug_ ( const ContainerAllocator &  _alloc) [inline]

Definition at line 42 of file EthercatDebug.h.


Member Data Documentation

template<class ContainerAllocator >
boost::shared_ptr<std::map<std::string, std::string> > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::__connection_header

Definition at line 97 of file EthercatDebug.h.

template<class ContainerAllocator >
::std_msgs::Header_<ContainerAllocator> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::header

Definition at line 59 of file EthercatDebug.h.

template<class ContainerAllocator >
int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::idle_time_us

Definition at line 92 of file EthercatDebug.h.

template<class ContainerAllocator >
std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::motor_data_packet_misc

Definition at line 80 of file EthercatDebug.h.

template<class ContainerAllocator >
std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::motor_data_packet_torque

Definition at line 77 of file EthercatDebug.h.

template<class ContainerAllocator >
::sr_robot_msgs::FromMotorDataType_<ContainerAllocator> sr_robot_msgs::EthercatDebug_< ContainerAllocator >::motor_data_type

Definition at line 65 of file EthercatDebug.h.

template<class ContainerAllocator >
std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::sensors

Definition at line 62 of file EthercatDebug.h.

template<class ContainerAllocator >
std::vector<int16_t, typename ContainerAllocator::template rebind<int16_t>::other > sr_robot_msgs::EthercatDebug_< ContainerAllocator >::tactile

Definition at line 89 of file EthercatDebug.h.

template<class ContainerAllocator >
int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::tactile_data_type

Definition at line 83 of file EthercatDebug.h.

template<class ContainerAllocator >
int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::tactile_data_valid

Definition at line 86 of file EthercatDebug.h.

template<class ContainerAllocator >
int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::which_motor_data_arrived

Definition at line 71 of file EthercatDebug.h.

template<class ContainerAllocator >
int32_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::which_motor_data_had_errors

Definition at line 74 of file EthercatDebug.h.

template<class ContainerAllocator >
int16_t sr_robot_msgs::EthercatDebug_< ContainerAllocator >::which_motors

Definition at line 68 of file EthercatDebug.h.


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


sr_robot_msgs
Author(s): Ugo Cupcic/ugo@shadowrobot.com
autogenerated on Fri Jan 3 2014 12:01:43