
Public Member Functions | |
| GripperTeleop (const std::string &name, ros::NodeHandle &nh) | |
| virtual void | publish (const ros::Duration &dt) |
| virtual bool | update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state) |
Public Member Functions inherited from TeleopComponent | |
| virtual bool | start () |
| virtual bool | stop () |
| TeleopComponent () | |
| virtual | ~TeleopComponent () |
Private Types | |
| typedef actionlib::SimpleActionClient< control_msgs::GripperCommandAction > | client_t |
Private Attributes | |
| boost::shared_ptr< client_t > | client_ |
| int | close_button_ |
| int | deadman_ |
| double | max_effort_ |
| double | max_position_ |
| double | min_position_ |
| int | open_button_ |
| bool | req_close_ |
| bool | req_open_ |
Additional Inherited Members | |
Protected Attributes inherited from TeleopComponent | |
| bool | active_ |
Definition at line 370 of file joystick_teleop.cpp.
|
private |
Definition at line 372 of file joystick_teleop.cpp.
|
inline |
Definition at line 375 of file joystick_teleop.cpp.
|
inlinevirtual |
Implements TeleopComponent.
Definition at line 418 of file joystick_teleop.cpp.
|
inlinevirtual |
Implements TeleopComponent.
Definition at line 401 of file joystick_teleop.cpp.
|
private |
Definition at line 442 of file joystick_teleop.cpp.
|
private |
Definition at line 439 of file joystick_teleop.cpp.
|
private |
Definition at line 439 of file joystick_teleop.cpp.
|
private |
Definition at line 440 of file joystick_teleop.cpp.
|
private |
Definition at line 440 of file joystick_teleop.cpp.
|
private |
Definition at line 440 of file joystick_teleop.cpp.
|
private |
Definition at line 439 of file joystick_teleop.cpp.
|
private |
Definition at line 441 of file joystick_teleop.cpp.
|
private |
Definition at line 441 of file joystick_teleop.cpp.