Skip to content
Snippets Groups Projects
Select Git revision
  • 9b8c551bb2a05ab06226c5da415842eab543e5f1
  • master default protected
  • grasping_sample
3 results

grasp_planner.launch

Blame
  • grasp_planner.launch 891 B
    <launch>
    
        <include file="$(find panda_simulation)/launch/simulation.launch"/>
    
        <include file="$(find panda_moveit_config)/launch/moveit_rviz.launch" />
    
        <node name="spawn_object" pkg="gazebo_ros" type="spawn_model" args="-urdf -z 1 -file $(find tutorial_moveit_motion_planning)/models/object.urdf -model c_object" respawn="false" output="screen" />
        <node name="spawn_table1" pkg="gazebo_ros" type="spawn_model" args="-urdf -z 1 -file $(find tutorial_moveit_motion_planning)/models/table1.urdf -model c_table1" respawn="false" output="screen" />
        <node name="spawn_table2" pkg="gazebo_ros" type="spawn_model" args="-urdf -z 1 -file $(find tutorial_moveit_motion_planning)/models/table2.urdf -model c_table2" respawn="false" output="screen" />
    
        <node pkg="sample_applications" type="GraspPlanner" name="GraspPlannerInstance" respawn="false" output="screen"/>
    
    </launch>