Public Types | Public Member Functions | Public Attributes
pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator > Struct Template Reference

#include <JinvExperimentalControllerState.h>

List of all members.

Public Types

typedef double _compliance_type
typedef double _df_type
typedef double _Df_type
typedef double _dx_type
typedef double _Dx_type
typedef
::geometry_msgs::Wrench_
< ContainerAllocator > 
_F_type
typedef ::std_msgs::Header_
< ContainerAllocator > 
_header_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_J_singular_values_type
typedef
::std_msgs::Float64MultiArray_
< ContainerAllocator > 
_J_type
typedef
::std_msgs::Float64MultiArray_
< ContainerAllocator > 
_N_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_q_proxy_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_qd_desi_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_qd_pose_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_qd_posture_raw_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_qd_posture_type
typedef double _stiffness_type
typedef std::vector< double,
typename
ContainerAllocator::template
rebind< double >::other > 
_tau_type
typedef
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
_x_desi_filtered_type
typedef
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
_x_desi_type
typedef
::geometry_msgs::Twist_
< ContainerAllocator > 
_x_err_type
typedef
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
_x_type
typedef
::geometry_msgs::Twist_
< ContainerAllocator > 
_xd_desi_type
typedef
::geometry_msgs::Twist_
< ContainerAllocator > 
_xd_type
typedef boost::shared_ptr
< ::pr2_manipulation_controllers::JinvExperimentalControllerState_
< ContainerAllocator > const > 
ConstPtr
typedef boost::shared_ptr
< ::pr2_manipulation_controllers::JinvExperimentalControllerState_
< ContainerAllocator > > 
Ptr
typedef
JinvExperimentalControllerState_
< ContainerAllocator > 
Type

Public Member Functions

 JinvExperimentalControllerState_ ()
 JinvExperimentalControllerState_ (const ContainerAllocator &_alloc)

Public Attributes

boost::shared_ptr< std::map
< std::string, std::string > > 
__connection_header
double compliance
double df
double Df
double dx
double Dx
::geometry_msgs::Wrench_
< ContainerAllocator > 
F
::std_msgs::Header_
< ContainerAllocator > 
header
::std_msgs::Float64MultiArray_
< ContainerAllocator > 
J
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
J_singular_values
::std_msgs::Float64MultiArray_
< ContainerAllocator > 
N
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
q_proxy
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
qd_desi
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
qd_pose
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
qd_posture
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
qd_posture_raw
double stiffness
std::vector< double, typename
ContainerAllocator::template
rebind< double >::other > 
tau
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
x
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
x_desi
::geometry_msgs::PoseStamped_
< ContainerAllocator > 
x_desi_filtered
::geometry_msgs::Twist_
< ContainerAllocator > 
x_err
::geometry_msgs::Twist_
< ContainerAllocator > 
xd
::geometry_msgs::Twist_
< ContainerAllocator > 
xd_desi

Detailed Description

template<class ContainerAllocator>
struct pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >

Definition at line 31 of file JinvExperimentalControllerState.h.


Member Typedef Documentation

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_compliance_type

Definition at line 154 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_df_type

Definition at line 139 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_Df_type

Definition at line 145 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_dx_type

Definition at line 142 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_Dx_type

Definition at line 148 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::Wrench_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_F_type

Definition at line 109 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::std_msgs::Header_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_header_type

Definition at line 88 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_J_singular_values_type

Definition at line 136 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::std_msgs::Float64MultiArray_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_J_type

Definition at line 130 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::std_msgs::Float64MultiArray_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_N_type

Definition at line 133 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_q_proxy_type

Definition at line 112 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_qd_desi_type

Definition at line 124 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_qd_pose_type

Definition at line 115 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_qd_posture_raw_type

Definition at line 121 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_qd_posture_type

Definition at line 118 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_stiffness_type

Definition at line 151 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_tau_type

Definition at line 127 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_x_desi_filtered_type

Definition at line 97 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_x_desi_type

Definition at line 94 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_x_err_type

Definition at line 100 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_x_type

Definition at line 91 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_xd_desi_type

Definition at line 106 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef ::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::_xd_type

Definition at line 103 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::pr2_manipulation_controllers::JinvExperimentalControllerState_<ContainerAllocator> const> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::ConstPtr

Definition at line 159 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef boost::shared_ptr< ::pr2_manipulation_controllers::JinvExperimentalControllerState_<ContainerAllocator> > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::Ptr

Definition at line 158 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
typedef JinvExperimentalControllerState_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::Type

Definition at line 32 of file JinvExperimentalControllerState.h.


Constructor & Destructor Documentation

template<class ContainerAllocator >
pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::JinvExperimentalControllerState_ ( ) [inline]

Definition at line 34 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::JinvExperimentalControllerState_ ( const ContainerAllocator &  _alloc) [inline]

Definition at line 61 of file JinvExperimentalControllerState.h.


Member Data Documentation

template<class ContainerAllocator >
boost::shared_ptr<std::map<std::string, std::string> > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::__connection_header

Definition at line 160 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::compliance

Definition at line 155 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::df

Definition at line 140 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::Df

Definition at line 146 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::dx

Definition at line 143 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::Dx

Definition at line 149 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::Wrench_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::F

Definition at line 110 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::std_msgs::Header_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::header

Definition at line 89 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::std_msgs::Float64MultiArray_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::J

Definition at line 131 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::J_singular_values

Definition at line 137 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::std_msgs::Float64MultiArray_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::N

Definition at line 134 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::q_proxy

Definition at line 113 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::qd_desi

Definition at line 125 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::qd_pose

Definition at line 116 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::qd_posture

Definition at line 119 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::qd_posture_raw

Definition at line 122 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
double pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::stiffness

Definition at line 152 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
std::vector<double, typename ContainerAllocator::template rebind<double>::other > pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::tau

Definition at line 128 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::x

Definition at line 92 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::x_desi

Definition at line 95 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::PoseStamped_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::x_desi_filtered

Definition at line 98 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::x_err

Definition at line 101 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::xd

Definition at line 104 of file JinvExperimentalControllerState.h.

template<class ContainerAllocator >
::geometry_msgs::Twist_<ContainerAllocator> pr2_manipulation_controllers::JinvExperimentalControllerState_< ContainerAllocator >::xd_desi

Definition at line 107 of file JinvExperimentalControllerState.h.


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


pr2_manipulation_controllers
Author(s): Kaijen Hsiao, Stu Glaser, Adam Leeper
autogenerated on Mon Oct 6 2014 12:10:46