Public Member Functions | |
| void | joySpacenavCallback (const sensor_msgs::Joy::ConstPtr &msg) |
| Receive Joy from a 6d input device (e.g. 3DConnexion SpaceNavigator) More... | |
| SpacenavCommander () | |
| void | timerCallback (const ros::TimerEvent &) |
| void | twistSpacenavCallback (const geometry_msgs::Twist::ConstPtr &msg) |
| Receive Twist from a 6d input device (e.g. 3DConnexion SpaceNavigator) More... | |
| ~SpacenavCommander () | |
Private Attributes | |
| bool | dead_man_enabled_ |
| std::string | frame_id_ |
| ros::Subscriber | joy_spacenav_sub_ |
| boost::mutex | mutex_ |
| ros::NodeHandle | nh_ |
| std::string | root_frame_ |
| double | scaling_factor_ |
| ros::Timer | timer_ |
| std::string | tip_frame_ |
| geometry_msgs::TwistStamped | ts_ |
| ros::Publisher | twist_pub_ |
| ros::Subscriber | twist_spacenav_sub_ |
Definition at line 26 of file spacenav_commander.cpp.
|
inline |
Definition at line 29 of file spacenav_commander.cpp.
|
inline |
Definition at line 64 of file spacenav_commander.cpp.
|
inline |
Receive Joy from a 6d input device (e.g. 3DConnexion SpaceNavigator)
Definition at line 69 of file spacenav_commander.cpp.
|
inline |
Definition at line 113 of file spacenav_commander.cpp.
|
inline |
Receive Twist from a 6d input device (e.g. 3DConnexion SpaceNavigator)
Definition at line 101 of file spacenav_commander.cpp.
|
private |
Definition at line 133 of file spacenav_commander.cpp.
|
private |
Definition at line 136 of file spacenav_commander.cpp.
|
private |
Definition at line 129 of file spacenav_commander.cpp.
|
private |
Definition at line 134 of file spacenav_commander.cpp.
|
private |
Definition at line 127 of file spacenav_commander.cpp.
|
private |
Definition at line 136 of file spacenav_commander.cpp.
|
private |
Definition at line 135 of file spacenav_commander.cpp.
|
private |
Definition at line 131 of file spacenav_commander.cpp.
|
private |
Definition at line 136 of file spacenav_commander.cpp.
|
private |
Definition at line 137 of file spacenav_commander.cpp.
|
private |
Definition at line 130 of file spacenav_commander.cpp.
|
private |
Definition at line 128 of file spacenav_commander.cpp.