Skip to content

Commit

Permalink
wow funky ordering
Browse files Browse the repository at this point in the history
  • Loading branch information
bmagyar committed Aug 5, 2024
1 parent 34fb590 commit 12339a5
Showing 1 changed file with 2 additions and 3 deletions.
5 changes: 2 additions & 3 deletions joy_teleop/test/test_array_indexing.py
Original file line number Diff line number Diff line change
Expand Up @@ -32,14 +32,13 @@
# ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
# POSSIBILITY OF SUCH DAMAGE.

import pytest

from joy_teleop_testing_common import generate_joy_test_description, TestJoyTeleop
from std_msgs.msg import UInt8MultiArray

import pytest
import rclpy



@pytest.mark.rostest
def generate_test_description():
parameters = {}
Expand Down

0 comments on commit 12339a5

Please sign in to comment.