
Public Member Functions | |
| BaseTeleop (const std::string &name, ros::NodeHandle &nh) | |
| virtual void | publish (const ros::Duration &dt) |
| virtual bool | start () |
| virtual bool | stop () |
| virtual bool | update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state) |
Public Member Functions inherited from TeleopComponent | |
| TeleopComponent () | |
| virtual | ~TeleopComponent () |
Private Member Functions | |
| void | odomCallback (const nav_msgs::OdometryConstPtr &odom) |
Private Attributes | |
| int | axis_w_ |
| int | axis_x_ |
| ros::Publisher | cmd_vel_pub_ |
| int | deadman_ |
| geometry_msgs::Twist | desired_ |
| geometry_msgs::Twist | last_ |
| double | max_acc_w_ |
| double | max_acc_x_ |
| double | max_vel_w_ |
| double | max_vel_x_ |
| double | max_windup_time |
| double | min_vel_x_ |
| ros::ServiceClient | mux_ |
| nav_msgs::Odometry | odom_ |
| boost::mutex | odom_mutex_ |
| ros::Subscriber | odom_sub_ |
| std::string | prev_mux_topic_ |
| bool | use_mux_ |
Additional Inherited Members | |
Protected Attributes inherited from TeleopComponent | |
| bool | active_ |
Definition at line 92 of file joystick_teleop.cpp.
|
inline |
Definition at line 95 of file joystick_teleop.cpp.
|
inlineprivate |
Definition at line 215 of file joystick_teleop.cpp.
|
inlinevirtual |
Implements TeleopComponent.
Definition at line 148 of file joystick_teleop.cpp.
|
inlinevirtual |
Reimplemented from TeleopComponent.
Definition at line 174 of file joystick_teleop.cpp.
|
inlinevirtual |
Reimplemented from TeleopComponent.
Definition at line 194 of file joystick_teleop.cpp.
|
inlinevirtual |
Implements TeleopComponent.
Definition at line 125 of file joystick_teleop.cpp.
|
private |
Definition at line 223 of file joystick_teleop.cpp.
|
private |
Definition at line 223 of file joystick_teleop.cpp.
|
private |
Definition at line 235 of file joystick_teleop.cpp.
|
private |
Definition at line 223 of file joystick_teleop.cpp.
|
private |
Definition at line 244 of file joystick_teleop.cpp.
|
private |
Definition at line 245 of file joystick_teleop.cpp.
|
private |
Definition at line 227 of file joystick_teleop.cpp.
|
private |
Definition at line 227 of file joystick_teleop.cpp.
|
private |
Definition at line 226 of file joystick_teleop.cpp.
|
private |
Definition at line 226 of file joystick_teleop.cpp.
|
private |
Definition at line 242 of file joystick_teleop.cpp.
|
private |
Definition at line 226 of file joystick_teleop.cpp.
|
private |
Definition at line 232 of file joystick_teleop.cpp.
|
private |
Definition at line 240 of file joystick_teleop.cpp.
|
private |
Definition at line 239 of file joystick_teleop.cpp.
|
private |
Definition at line 236 of file joystick_teleop.cpp.
|
private |
Definition at line 231 of file joystick_teleop.cpp.
|
private |
Definition at line 230 of file joystick_teleop.cpp.