Public Types | Public Member Functions | Private Attributes
labust::control::RefManual< Enable > Struct Template Reference

The manual reference controller. More...

List of all members.

Public Types

enum  {
  u = 0, v, w, p,
  q, r
}

Public Member Functions

void init ()
void initialize_manual ()
void onEstimate (const auv_msgs::NavSts::ConstPtr &state)
void onJoy (const sensor_msgs::Joy::ConstPtr &joy)
 RefManual ()

Private Attributes

auv_msgs::NavSts baseRef
boost::mutex cnt_mux
ros::Subscriber joyIn
JoystickMapping mapper
Eigen::Vector6d nu_max
ros::Subscriber stateHat
bool stateReady
ros::Publisher stateRef
double Ts

Detailed Description

template<class Enable>
struct labust::control::RefManual< Enable >

The manual reference controller.

Definition at line 51 of file RefManual.cpp.


Member Enumeration Documentation

template<class Enable>
anonymous enum
Enumerator:
u 
v 
w 
p 
q 
r 

Definition at line 53 of file RefManual.cpp.


Constructor & Destructor Documentation

template<class Enable>
labust::control::RefManual< Enable >::RefManual ( ) [inline]

Definition at line 54 of file RefManual.cpp.


Member Function Documentation

template<class Enable>
void labust::control::RefManual< Enable >::init ( ) [inline]

Definition at line 59 of file RefManual.cpp.

template<class Enable>
void labust::control::RefManual< Enable >::initialize_manual ( ) [inline]

Definition at line 119 of file RefManual.cpp.

template<class Enable>
void labust::control::RefManual< Enable >::onEstimate ( const auv_msgs::NavSts::ConstPtr &  state) [inline]

Definition at line 74 of file RefManual.cpp.

template<class Enable>
void labust::control::RefManual< Enable >::onJoy ( const sensor_msgs::Joy::ConstPtr &  joy) [inline]

Definition at line 87 of file RefManual.cpp.


Member Data Documentation

template<class Enable>
auv_msgs::NavSts labust::control::RefManual< Enable >::baseRef [private]

Definition at line 136 of file RefManual.cpp.

template<class Enable>
boost::mutex labust::control::RefManual< Enable >::cnt_mux [private]

Definition at line 137 of file RefManual.cpp.

template<class Enable>
ros::Subscriber labust::control::RefManual< Enable >::joyIn [private]

Definition at line 131 of file RefManual.cpp.

template<class Enable>
JoystickMapping labust::control::RefManual< Enable >::mapper [private]

Definition at line 135 of file RefManual.cpp.

template<class Enable>
Eigen::Vector6d labust::control::RefManual< Enable >::nu_max [private]

Definition at line 133 of file RefManual.cpp.

template<class Enable>
ros::Subscriber labust::control::RefManual< Enable >::stateHat [private]

Definition at line 131 of file RefManual.cpp.

template<class Enable>
bool labust::control::RefManual< Enable >::stateReady [private]

Definition at line 138 of file RefManual.cpp.

template<class Enable>
ros::Publisher labust::control::RefManual< Enable >::stateRef [private]

Definition at line 132 of file RefManual.cpp.

template<class Enable>
double labust::control::RefManual< Enable >::Ts [private]

Definition at line 134 of file RefManual.cpp.


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


labust_control
Author(s): Gyula Nagy
autogenerated on Fri Feb 7 2014 11:36:43