File tree Expand file tree Collapse file tree 1 file changed +10
-7
lines changed
doc/planning_scene_python/src Expand file tree Collapse file tree 1 file changed +10
-7
lines changed Original file line number Diff line number Diff line change 11#!/usr/bin/env python
22import sys
3+ import rospy
34
45def main ():
5- rospy .init_node ("planning_scene_tutorial" )
6- moveit_commander .roscpp_initialize (sys .argv )
7-
86 # BEGIN_TUTORIAL
97 #
108 # Setup
@@ -19,13 +17,18 @@ def main():
1917 # using data from the robot's joints and the sensors on the robot. In
2018 # this tutorial, we will instantiate a PlanningScene class directly,
2119 # but this method of instantiation is only intended for illustration.
22- import moveit_commander
23- import numpy as np
24- import rospy
2520 from geometry_msgs .msg import PoseStamped
26- import moveit .core
2721 from moveit .core import kinematic_constraints , collision_detection , robot_model
2822 from moveit .core .planning_scene import PlanningScene
23+ import moveit .core
24+ import moveit_commander
25+ import numpy as np
26+ import pathlib
27+ import rospkg
28+ import rospy
29+
30+ rospy .init_node ("planning_scene_tutorial" )
31+ moveit_commander .roscpp_initialize (sys .argv )
2932
3033 r = rospkg .RosPack ()
3134 urdf_path = pathlib .Path (r .get_path ("moveit_resources_panda_description" )) / "urdf" / "panda.urdf"
You can’t perform that action at this time.
0 commit comments