ros-pybullet / ros_pybullet_interface

ROS-PyBullet Interface.
https://ros-pybullet.github.io/ros_pybullet_interface/
BSD 3-Clause "New" or "Revised" License
77 stars 14 forks source link

Coudn't find omni.cpp and touch_x_transform.cpp in geomagic_touch_x_ros package as mentioned in launch file. #12

Open RaMathuZen opened 1 year ago

RaMathuZen commented 1 year ago

Hi, I'm trying to port the human interaction example with the Geomagic Touch instead of Touch X. While going through the files, In human_interaction.launch file present in rpbi_examples package, there were these XML code snippets,

 <node pkg="geomagic_touch_x_ros" name="omni" type="omni" output="screen" required="true">
    <param name="omni_name" value="$(arg robot_name)" />
    <param name="device_name" value="$(arg robot_name)" />
    <param name="Kp_target" value="$(arg omni_kp)" />
    <param name="motion_scaling" value="$(arg motion_scaling)" />
    <param name="lock_position" value="$(arg lock_position)" />
  </node>

 <node pkg="geomagic_touch_x_ros" name="touch_x_transform" type="touch_x_transform" >
    <param name="omni_name" value="$(arg robot_name)" />
    <param name="motion_scaling" value="$(arg motion_scaling)" />
    <remap from="/omni_joints" to="/$(arg robot_name)/joints" />
  </node>

so which implies that there are executables omni and touch_x_transform corresponding to their cpp files in geomagic_touch_x_ros package but when I searched for those in geomagic_touch_x_ros package I coudn't find any. Are they missing ?