Skip to content
Open
Show file tree
Hide file tree
Changes from all commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
2 changes: 1 addition & 1 deletion aquadrone_description/test/test_models.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import unittest
import rospy
Expand Down
Empty file.
2 changes: 1 addition & 1 deletion aquadrone_math_utils/test/test_quaternion.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion aquadrone_sensors/nodes/battery_sensor.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import sys
Expand Down
2 changes: 1 addition & 1 deletion aquadrone_sensors/nodes/ms5837_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
from sensor_msgs.msg import FluidPressure
Expand Down
2 changes: 1 addition & 1 deletion aquadrone_sensors/nodes/sim_pressure_sensor_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8
import rospy
from aquadrone_sensors.sim_pressure_sensor import SimPressureSensor

Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/barrel_roll_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/dive_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/pole_circling_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8
import rospy
import rospkg

Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/pole_finder_demo.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/square_travel_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/thruster_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion path_planning/nodes/yaw_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion path_planning/test/test_flowchart_creation.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion path_planning/test/test_go_to_depth_state.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion path_planning/test/test_ros_modules.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion stability/nodes/depth_control_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion stability/nodes/movement_control_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
from stability.movement_pid_controller import MovementPIDController
Expand Down
2 changes: 1 addition & 1 deletion stability/nodes/orientation_control_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8


import rospy
Expand Down
2 changes: 1 addition & 1 deletion stability/test/test_depth_control.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion state_estimation/nodes/ekf_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion state_estimation/nodes/omniscient_ekf_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
from state_estimation.omniscient_ekf import OmniscientEKF
Expand Down
2 changes: 1 addition & 1 deletion state_estimation/test/test_ekf.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/nodes/faulty_thrust_distributor_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion thruster_control/nodes/real_thruster_pwm_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/nodes/thrust_computer_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion thruster_control/nodes/thrust_distributor_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy

Expand Down
2 changes: 1 addition & 1 deletion thruster_control/scripts/config_method_comp.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8
import numpy as np

from thrust_computer.thruster_configurations import V28Configuration
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/scripts/t100_conversion_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

from real_thruster_types.thruster_types import T100Thruster
from uuv_gazebo_ros_plugins_msgs.msg import FloatStamped
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/scripts/v28_thruster_connection_test.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rospkg
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/test/test_movement_command_collector.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/test/test_thrust_computer.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/test/test_thruster_configurations.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion thruster_control/test/test_thruster_types.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8

import rospy
import rostest
Expand Down
2 changes: 1 addition & 1 deletion vision/nodes/omniscient_vision_node.py
Original file line number Diff line number Diff line change
@@ -1,4 +1,4 @@
#!/usr/bin/env python3
#!/usr/bin/env python3.8
import rospy
from vision.omniscient_vision import OmniscientVision

Expand Down