In this section, we will demonstrate how to create a teleoperation node for a robot using Leap Motion data. The procedure is very simple. We can create a ROS package for this node using the following steps:
- The following is the command to create a new package. You can also find this package in chapter_11_ws/vr_leap_teleop:
$ catkin_create_pkg vr_leap_teleop roscpp rospy std_msgs visualization_msgs geometry_msgs message_generation visualization_msgs
After creation, you could build the workspace using catkin_make command.
- Now, let's create the node to convert Leap Motion data to Twist. You can create a folder called scripts inside the vr_leap_teleop package.
- Now you can copy the node called vr_leap_teleop.py from our repository at https://github.com/PacktPublishing/ROS-Robotics-Projects-SecondEdition/blob/master...