Skip to content

Commit

Permalink
Switch shebang to python3
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Jul 11, 2024
1 parent 4debc37 commit 93ef98a
Show file tree
Hide file tree
Showing 18 changed files with 18 additions and 18 deletions.
2 changes: 1 addition & 1 deletion core/python/test/rostest_mps.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3

from __future__ import print_function
import unittest
Expand Down
2 changes: 1 addition & 1 deletion core/python/test/rostest_mtc.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3

from __future__ import print_function
import unittest
Expand Down
2 changes: 1 addition & 1 deletion core/python/test/rostest_trampoline.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from __future__ import print_function
Expand Down
2 changes: 1 addition & 1 deletion core/python/test/test_mtc.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from __future__ import print_function
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/alternatives.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/cartesian.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from std_msgs.msg import Header
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/compute_ik.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/constrained.py
100644 → 100755
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from std_msgs.msg import Header
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/current_state.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/fallbacks.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/fix_collision_objects.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/fixed_state.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.core import planning_scene
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/generate_pose.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/merger.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/modify_planning_scene.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/multi_planner.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/pickplace.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from py_binding_tools import roscpp_init
Expand Down
2 changes: 1 addition & 1 deletion demo/scripts/properties.py
100644 → 100755
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#! /usr/bin/env python
#! /usr/bin/env python3
# -*- coding: utf-8 -*-

from moveit.task_constructor import core, stages
Expand Down

0 comments on commit 93ef98a

Please sign in to comment.