Public Member Functions | |
virtual void | publish (const ros::Duration &dt)=0 |
virtual bool | start () |
virtual bool | stop () |
TeleopComponent () | |
virtual bool | update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state)=0 |
virtual | ~TeleopComponent () |
Protected Attributes | |
bool | active_ |
Definition at line 59 of file joystick_teleop.cpp.
TeleopComponent::TeleopComponent | ( | ) | [inline] |
Definition at line 62 of file joystick_teleop.cpp.
virtual TeleopComponent::~TeleopComponent | ( | ) | [inline, virtual] |
Definition at line 63 of file joystick_teleop.cpp.
virtual void TeleopComponent::publish | ( | const ros::Duration & | dt | ) | [pure virtual] |
Implemented in ArmTeleop, HeadTeleop, GripperTeleop, FollowTeleop, and BaseTeleop.
virtual bool TeleopComponent::start | ( | ) | [inline, virtual] |
Reimplemented in ArmTeleop, and BaseTeleop.
Definition at line 74 of file joystick_teleop.cpp.
virtual bool TeleopComponent::stop | ( | ) | [inline, virtual] |
Reimplemented in ArmTeleop, HeadTeleop, FollowTeleop, and BaseTeleop.
Definition at line 81 of file joystick_teleop.cpp.
virtual bool TeleopComponent::update | ( | const sensor_msgs::Joy::ConstPtr & | joy, |
const sensor_msgs::JointState::ConstPtr & | state | ||
) | [pure virtual] |
Implemented in ArmTeleop, HeadTeleop, GripperTeleop, FollowTeleop, and BaseTeleop.
bool TeleopComponent::active_ [protected] |
Definition at line 88 of file joystick_teleop.cpp.