aboutsummaryrefslogtreecommitdiff
path: root/src/platforms/ros/nodes/README.md
diff options
context:
space:
mode:
Diffstat (limited to 'src/platforms/ros/nodes/README.md')
-rw-r--r--src/platforms/ros/nodes/README.md18
1 files changed, 18 insertions, 0 deletions
diff --git a/src/platforms/ros/nodes/README.md b/src/platforms/ros/nodes/README.md
index 277f57bfd..aafc647ff 100644
--- a/src/platforms/ros/nodes/README.md
+++ b/src/platforms/ros/nodes/README.md
@@ -2,3 +2,21 @@
This directory contains several small ROS nodes which are intended to run alongside the PX4 multi-platform nodes in
ROS. They act as a bridge between the PX4 specific topics and the ROS topics.
+
+## Joystick Input
+
+You will need to install the ros joystick packages
+See http://wiki.ros.org/joy/Tutorials/ConfiguringALinuxJoystick
+
+### Arch Linux
+```sh
+yaourt -Sy ros-indigo-joystick-drivers --noconfirm
+```
+check joystick
+```sh
+ls /dev/input/
+ls -l /dev/input/js0
+```
+(replace 0 by the number you find with the first command)
+
+make sure the joystick is accessible by the `input` group and that your user is in the `input` group