Public Member Functions | Protected Attributes
vigir_footstep_planning::JoystickAxis Class Reference

#include <joystick_handler.h>

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

List of all members.

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)

Protected Attributes

int axis_id_
double calib_offset_
bool invert_
double max_
double min_
double scale_factor_
double scale_offset_
double zero_val_

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.

Definition at line 109 of file joystick_handler.h.


Member Function Documentation

bool vigir_footstep_planning::JoystickAxis::isPressed ( ) const [inline, override, virtual]

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) [inline, override, virtual]

Implements vigir_footstep_planning::JoystickInputHandle.

Definition at line 113 of file joystick_handler.h.


Member Data Documentation

Definition at line 135 of file joystick_handler.h.

Definition at line 141 of file joystick_handler.h.

Definition at line 143 of file joystick_handler.h.

Definition at line 138 of file joystick_handler.h.

Definition at line 137 of file joystick_handler.h.

Definition at line 145 of file joystick_handler.h.

Definition at line 146 of file joystick_handler.h.

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 Thu Jun 6 2019 18:38:16