Skip to content

Commit

Permalink
fix imports
Browse files Browse the repository at this point in the history
  • Loading branch information
PeterMitrano committed Jul 19, 2021
1 parent c3a49d3 commit 7bf2f54
Showing 1 changed file with 10 additions and 7 deletions.
17 changes: 10 additions & 7 deletions doc/planning_scene_python/src/planning_scene_tutorial.py
Original file line number Diff line number Diff line change
@@ -1,10 +1,8 @@
#!/usr/bin/env python
import sys
import rospy

def main():
rospy.init_node("planning_scene_tutorial")
moveit_commander.roscpp_initialize(sys.argv)

# BEGIN_TUTORIAL
#
# Setup
Expand All @@ -19,13 +17,18 @@ def main():
# using data from the robot's joints and the sensors on the robot. In
# this tutorial, we will instantiate a PlanningScene class directly,
# but this method of instantiation is only intended for illustration.
import moveit_commander
import numpy as np
import rospy
from geometry_msgs.msg import PoseStamped
import moveit.core
from moveit.core import kinematic_constraints, collision_detection, robot_model
from moveit.core.planning_scene import PlanningScene
import moveit.core
import moveit_commander
import numpy as np
import pathlib
import rospkg
import rospy

rospy.init_node("planning_scene_tutorial")
moveit_commander.roscpp_initialize(sys.argv)

r = rospkg.RosPack()
urdf_path = pathlib.Path(r.get_path("moveit_resources_panda_description")) / "urdf" / "panda.urdf"
Expand Down

0 comments on commit 7bf2f54

Please sign in to comment.