#include <Joystick.hpp>
Public Member Functions | |
virtual void | destroy () |
virtual void | didBecomeActive (const TKState ¤tState, const Behavior &previousBehavior) |
virtual void | didBecomeInActive (const TKState ¤tState, const Behavior &nextBehavior) |
virtual void | initialize () |
virtual bool | isValid (const TKState ¤tState) const |
Joystick () | |
virtual void | trajectoryStepActive (const TKState ¤tState, TKTrajectory &generatedTrajInput) |
virtual void | trajectoryStepCreation (const TKState ¤tState, TKTrajectory &generatedTrajInput) |
virtual void | trajectoryStepTermination (const TKState ¤tState, TKTrajectory &generatedTrajInput) |
virtual bool | willBecomeActive (const TKState ¤tState, const Behavior &previousBehavior) |
virtual void | willBecomeInActive (const TKState ¤tState, const Behavior &nextBehavior) |
Protected Member Functions | |
void | joystickCB (const sensor_msgs::Joy::ConstPtr &msg) |
Protected Attributes | |
ros::Subscriber | joySub |
Velocity3D | lastVelocityInput |
double | lastYawRateInput |
ros::NodeHandle | nodeHandle |
Position3D | posModeCurPosition |
Angle | posModeCurYawAngle |
Time | posModeLastInputTime |
Option< std::string > * | tJoystickTopic |
Option< bool > * | tJoystickUseDeadManSwitch |
Option< bool > * | tJoystickUsePositionMode |
Option< bool > * | tJoystickUseRelativeMode |
Option< double > * | tJoystickYawRateScale |
bool | valid |
Definition at line 26 of file Joystick.hpp.
Definition at line 17 of file Joystick.cpp.
void telekyb_behavior::Joystick::destroy | ( | ) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 81 of file Joystick.cpp.
void telekyb_behavior::Joystick::didBecomeActive | ( | const TKState & | currentState, |
const Behavior & | previousBehavior | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 105 of file Joystick.cpp.
void telekyb_behavior::Joystick::didBecomeInActive | ( | const TKState & | currentState, |
const Behavior & | nextBehavior | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 115 of file Joystick.cpp.
void telekyb_behavior::Joystick::initialize | ( | ) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 59 of file Joystick.cpp.
bool telekyb_behavior::Joystick::isValid | ( | const TKState & | currentState | ) | const [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 189 of file Joystick.cpp.
void telekyb_behavior::Joystick::joystickCB | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) | [protected] |
Definition at line 23 of file Joystick.cpp.
void telekyb_behavior::Joystick::trajectoryStepActive | ( | const TKState & | currentState, |
TKTrajectory & | generatedTrajInput | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 128 of file Joystick.cpp.
void telekyb_behavior::Joystick::trajectoryStepCreation | ( | const TKState & | currentState, |
TKTrajectory & | generatedTrajInput | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 121 of file Joystick.cpp.
void telekyb_behavior::Joystick::trajectoryStepTermination | ( | const TKState & | currentState, |
TKTrajectory & | generatedTrajInput | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 182 of file Joystick.cpp.
bool telekyb_behavior::Joystick::willBecomeActive | ( | const TKState & | currentState, |
const Behavior & | previousBehavior | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 86 of file Joystick.cpp.
void telekyb_behavior::Joystick::willBecomeInActive | ( | const TKState & | currentState, |
const Behavior & | nextBehavior | ||
) | [virtual] |
Implements TELEKYB_NAMESPACE::Behavior.
Definition at line 110 of file Joystick.cpp.
ros::Subscriber telekyb_behavior::Joystick::joySub [protected] |
Definition at line 39 of file Joystick.hpp.
Definition at line 43 of file Joystick.hpp.
double telekyb_behavior::Joystick::lastYawRateInput [protected] |
Definition at line 44 of file Joystick.hpp.
Reimplemented from TELEKYB_NAMESPACE::Behavior.
Definition at line 38 of file Joystick.hpp.
Definition at line 47 of file Joystick.hpp.
Angle telekyb_behavior::Joystick::posModeCurYawAngle [protected] |
Definition at line 48 of file Joystick.hpp.
Time telekyb_behavior::Joystick::posModeLastInputTime [protected] |
Definition at line 49 of file Joystick.hpp.
Option<std::string>* telekyb_behavior::Joystick::tJoystickTopic [protected] |
Definition at line 28 of file Joystick.hpp.
Option<bool>* telekyb_behavior::Joystick::tJoystickUseDeadManSwitch [protected] |
Definition at line 35 of file Joystick.hpp.
Option<bool>* telekyb_behavior::Joystick::tJoystickUsePositionMode [protected] |
Definition at line 29 of file Joystick.hpp.
Option<bool>* telekyb_behavior::Joystick::tJoystickUseRelativeMode [protected] |
Definition at line 33 of file Joystick.hpp.
Option<double>* telekyb_behavior::Joystick::tJoystickYawRateScale [protected] |
Definition at line 30 of file Joystick.hpp.
bool telekyb_behavior::Joystick::valid [protected] |
Definition at line 52 of file Joystick.hpp.