Functions | |
| def | callback (msg) |
| def | publishModeText (message) |
Variables | |
| bool | display_separate_mode = True |
| ns = rospy.get_param('~transformable_interactive_server_nodename', '') | |
| string | PKG = 'sensor_msgs' |
| int | prev_b = 0 |
| rx_max = rospy.get_param("~rx_max") | |
| ry_max = rospy.get_param("~ry_max") | |
| rz_max = rospy.get_param("~rz_max") | |
| s = rospy.Subscriber("input_joy", Joy, callback) | |
| send_text_pub = rospy.Publisher("separate_mode_text", OverlayText) | |
| separate_mode = rospy.get_param("~separate_mode") | |
| set_pose_pub = None | |
| bool | translate_mode = True |
| int | x_max = 10 |
| int | y_max = 10 |
| int | z_max = 10 |
| def transformable_spacenav_configure.callback | ( | msg | ) |
Definition at line 27 of file transformable_spacenav_configure.py.
| def transformable_spacenav_configure.publishModeText | ( | message | ) |
Definition at line 64 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.display_separate_mode = True |
Definition at line 26 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.ns = rospy.get_param('~transformable_interactive_server_nodename', '') |
Definition at line 87 of file transformable_spacenav_configure.py.
| string transformable_spacenav_configure.PKG = 'sensor_msgs' |
Definition at line 5 of file transformable_spacenav_configure.py.
| int transformable_spacenav_configure.prev_b = 0 |
Definition at line 24 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.rx_max = rospy.get_param("~rx_max") |
Definition at line 92 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.ry_max = rospy.get_param("~ry_max") |
Definition at line 93 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.rz_max = rospy.get_param("~rz_max") |
Definition at line 94 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.s = rospy.Subscriber("input_joy", Joy, callback) |
Definition at line 102 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.send_text_pub = rospy.Publisher("separate_mode_text", OverlayText) |
Definition at line 100 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.separate_mode = rospy.get_param("~separate_mode") |
Definition at line 96 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.set_pose_pub = None |
Definition at line 23 of file transformable_spacenav_configure.py.
| bool transformable_spacenav_configure.translate_mode = True |
Definition at line 25 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.x_max = 10 |
Definition at line 19 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.y_max = 10 |
Definition at line 20 of file transformable_spacenav_configure.py.
| transformable_spacenav_configure.z_max = 10 |
Definition at line 21 of file transformable_spacenav_configure.py.