Skip to content

Commit 93ef98a

Browse files
committed
Switch shebang to python3
1 parent 4debc37 commit 93ef98a

18 files changed

+18
-18
lines changed

core/python/test/rostest_mps.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22

33
from __future__ import print_function
44
import unittest

core/python/test/rostest_mtc.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22

33
from __future__ import print_function
44
import unittest

core/python/test/rostest_trampoline.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from __future__ import print_function

core/python/test/test_mtc.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from __future__ import print_function

demo/scripts/alternatives.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from moveit.task_constructor import core, stages

demo/scripts/cartesian.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from std_msgs.msg import Header

demo/scripts/compute_ik.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from moveit.task_constructor import core, stages

demo/scripts/constrained.py

100644100755
Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from std_msgs.msg import Header

demo/scripts/current_state.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from moveit.task_constructor import core, stages

demo/scripts/fallbacks.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
#! /usr/bin/env python
1+
#! /usr/bin/env python3
22
# -*- coding: utf-8 -*-
33

44
from moveit.task_constructor import core, stages

0 commit comments

Comments
 (0)