Public Member Functions | Protected Attributes | List of all members
vigir_footstep_planning::JoystickAxis Class Reference

#include <joystick_handler.h>

Inheritance diagram for vigir_footstep_planning::JoystickAxis:
Inheritance graph
[legend]

Public Member Functions

bool isPressed () const override
 
void joyCallback (const sensor_msgs::Joy::ConstPtr &joy_msg) override
 
 JoystickAxis (int axis, double thresh=1.0, double min_val=-1.0, double max_val=1.0, double zero_val=0.0, double calib_offset=0.0, bool invert=false)
 
 JoystickAxis (XmlRpc::XmlRpcValue &params)
 
- Public Member Functions inherited from vigir_footstep_planning::JoystickInputHandle
virtual double getValue () const
 
 JoystickInputHandle (double thresh=1.0)
 

Protected Attributes

int axis_id_
 
double calib_offset_
 
bool invert_
 
double max_
 
double min_
 
double scale_factor_
 
double scale_offset_
 
double zero_val_
 
- Protected Attributes inherited from vigir_footstep_planning::JoystickInputHandle
double thresh_
 
double val_
 

Additional Inherited Members

- Public Types inherited from vigir_footstep_planning::JoystickInputHandle
typedef boost::shared_ptr< JoystickInputHandleConstPtr
 
typedef boost::shared_ptr< JoystickInputHandlePtr
 

Detailed Description

Definition at line 91 of file joystick_handler.h.

Constructor & Destructor Documentation

vigir_footstep_planning::JoystickAxis::JoystickAxis ( int  axis,
double  thresh = 1.0,
double  min_val = -1.0,
double  max_val = 1.0,
double  zero_val = 0.0,
double  calib_offset = 0.0,
bool  invert = false 
)
inline

Definition at line 95 of file joystick_handler.h.

vigir_footstep_planning::JoystickAxis::JoystickAxis ( XmlRpc::XmlRpcValue params)
inline

Definition at line 109 of file joystick_handler.h.

Member Function Documentation

bool vigir_footstep_planning::JoystickAxis::isPressed ( ) const
inlineoverridevirtual

Reimplemented from vigir_footstep_planning::JoystickInputHandle.

Definition at line 132 of file joystick_handler.h.

void vigir_footstep_planning::JoystickAxis::joyCallback ( const sensor_msgs::Joy::ConstPtr &  joy_msg)
inlineoverridevirtual

Implements vigir_footstep_planning::JoystickInputHandle.

Definition at line 113 of file joystick_handler.h.

Member Data Documentation

int vigir_footstep_planning::JoystickAxis::axis_id_
protected

Definition at line 135 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::calib_offset_
protected

Definition at line 141 of file joystick_handler.h.

bool vigir_footstep_planning::JoystickAxis::invert_
protected

Definition at line 143 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::max_
protected

Definition at line 138 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::min_
protected

Definition at line 137 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::scale_factor_
protected

Definition at line 145 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::scale_offset_
protected

Definition at line 146 of file joystick_handler.h.

double vigir_footstep_planning::JoystickAxis::zero_val_
protected

Definition at line 139 of file joystick_handler.h.


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


vigir_pattern_generator
Author(s): Alexander Stumpf
autogenerated on Sun Nov 17 2019 03:30:06