
| Public Member Functions | |
| HeadTeleop (const std::string &name, ros::NodeHandle &nh) | |
| virtual void | publish (const ros::Duration &dt) | 
| virtual bool | stop () | 
| virtual bool | update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state) | 
| Private Types | |
| typedef actionlib::SimpleActionClient < control_msgs::FollowJointTrajectoryAction > | client_t | 
| Private Attributes | |
| double | actual_pos_pan_ | 
| double | actual_pos_tilt_ | 
| int | axis_pan_ | 
| int | axis_tilt_ | 
| boost::shared_ptr< client_t > | client_ | 
| int | deadman_ | 
| double | desired_pan_ | 
| double | desired_tilt_ | 
| std::string | head_pan_joint_ | 
| std::string | head_tilt_joint_ | 
| double | last_pan_ | 
| double | last_tilt_ | 
| double | max_acc_pan_ | 
| double | max_acc_tilt_ | 
| double | max_pos_pan_ | 
| double | max_pos_tilt_ | 
| double | max_vel_pan_ | 
| double | max_vel_tilt_ | 
| double | min_pos_pan_ | 
| double | min_pos_tilt_ | 
Definition at line 447 of file joystick_teleop.cpp.
| typedef actionlib::SimpleActionClient<control_msgs::FollowJointTrajectoryAction> HeadTeleop::client_t  [private] | 
Definition at line 449 of file joystick_teleop.cpp.
| HeadTeleop::HeadTeleop | ( | const std::string & | name, | 
| ros::NodeHandle & | nh | ||
| ) |  [inline] | 
Definition at line 452 of file joystick_teleop.cpp.
| virtual void HeadTeleop::publish | ( | const ros::Duration & | dt | ) |  [inline, virtual] | 
Implements TeleopComponent.
Definition at line 513 of file joystick_teleop.cpp.
| virtual bool HeadTeleop::stop | ( | ) |  [inline, virtual] | 
Reimplemented from TeleopComponent.
Definition at line 550 of file joystick_teleop.cpp.
| virtual bool HeadTeleop::update | ( | const sensor_msgs::Joy::ConstPtr & | joy, | 
| const sensor_msgs::JointState::ConstPtr & | state | ||
| ) |  [inline, virtual] | 
Implements TeleopComponent.
Definition at line 486 of file joystick_teleop.cpp.
| double HeadTeleop::actual_pos_pan_  [private] | 
Definition at line 563 of file joystick_teleop.cpp.
| double HeadTeleop::actual_pos_tilt_  [private] | 
Definition at line 563 of file joystick_teleop.cpp.
| int HeadTeleop::axis_pan_  [private] | 
Definition at line 558 of file joystick_teleop.cpp.
| int HeadTeleop::axis_tilt_  [private] | 
Definition at line 558 of file joystick_teleop.cpp.
| boost::shared_ptr<client_t> HeadTeleop::client_  [private] | 
Definition at line 566 of file joystick_teleop.cpp.
| int HeadTeleop::deadman_  [private] | 
Definition at line 558 of file joystick_teleop.cpp.
| double HeadTeleop::desired_pan_  [private] | 
Definition at line 564 of file joystick_teleop.cpp.
| double HeadTeleop::desired_tilt_  [private] | 
Definition at line 564 of file joystick_teleop.cpp.
| std::string HeadTeleop::head_pan_joint_  [private] | 
Definition at line 562 of file joystick_teleop.cpp.
| std::string HeadTeleop::head_tilt_joint_  [private] | 
Definition at line 562 of file joystick_teleop.cpp.
| double HeadTeleop::last_pan_  [private] | 
Definition at line 565 of file joystick_teleop.cpp.
| double HeadTeleop::last_tilt_  [private] | 
Definition at line 565 of file joystick_teleop.cpp.
| double HeadTeleop::max_acc_pan_  [private] | 
Definition at line 560 of file joystick_teleop.cpp.
| double HeadTeleop::max_acc_tilt_  [private] | 
Definition at line 560 of file joystick_teleop.cpp.
| double HeadTeleop::max_pos_pan_  [private] | 
Definition at line 561 of file joystick_teleop.cpp.
| double HeadTeleop::max_pos_tilt_  [private] | 
Definition at line 561 of file joystick_teleop.cpp.
| double HeadTeleop::max_vel_pan_  [private] | 
Definition at line 559 of file joystick_teleop.cpp.
| double HeadTeleop::max_vel_tilt_  [private] | 
Definition at line 559 of file joystick_teleop.cpp.
| double HeadTeleop::min_pos_pan_  [private] | 
Definition at line 561 of file joystick_teleop.cpp.
| double HeadTeleop::min_pos_tilt_  [private] | 
Definition at line 561 of file joystick_teleop.cpp.