Skip to content

Commit

Permalink
rename to hl
Browse files Browse the repository at this point in the history
  • Loading branch information
Flova committed Jan 16, 2024
1 parent b6547f7 commit fae7ff6
Show file tree
Hide file tree
Showing 18 changed files with 29 additions and 29 deletions.
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
---
# Game controller network settings

game_controller_humanoid:
game_controller_hl:
ros__parameters:
listen_host: '0.0.0.0'
listen_port: 3838
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -22,10 +22,10 @@
from rclpy.duration import Duration
from std_msgs.msg import Header
from construct import Container
from game_controller_humanoid.gamestate import GameStateStruct, ResponseStruct
from game_controller_humanoid.utils import get_parameters_from_other_node
from game_controller_hl.gamestate import GameStateStruct, ResponseStruct
from game_controller_hl.utils import get_parameters_from_other_node

from game_controller_humanoid_interfaces.msg import GameState
from game_controller_hl_interfaces.msg import GameState


class GameStateReceiver(Node):
Expand Down
9 changes: 9 additions & 0 deletions game_controller_hl/launch/game_controller.launch
Original file line number Diff line number Diff line change
@@ -0,0 +1,9 @@
<?xml version="1.0" encoding="utf-8" ?>
<launch>
<arg name="sim" default="false" />

<node pkg="game_controller_hl" exec="game_controller" name="game_controller_hl" output="screen">
<param from="$(find-pkg-share game_controller_hl)/config/game_controller_settings.yaml" />
<param name="use_sim_time" value="$(var sim)" />
</node>
</launch>
Original file line number Diff line number Diff line change
@@ -1,11 +1,11 @@
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>game_controller_humanoid</name>
<name>game_controller_hl</name>
<version>1.1.0</version>
<description>
The game_controller_humanoid packages receives packets from the GameController and
republishes them as bitbots_msgs/GameState ROS messages. It sends response packets
The game_controller_hl packages receives packets from the GameController and
republishes them as GameState ROS messages. It sends response packets
back to the GameController.
</description>

Expand All @@ -19,7 +19,7 @@
<buildtool_depend>rosidl_default_generators</buildtool_depend>
<exec_depend>rosidl_default_runtime</exec_depend>

<depend>game_controller_humanoid_interfaces</depend>
<depend>game_controller_hl_interfaces</depend>
<depend>python3-construct</depend>
<depend>rclpy</depend>
<depend>std_msgs</depend>
Expand Down
File renamed without changes.
4 changes: 4 additions & 0 deletions game_controller_hl/setup.cfg
Original file line number Diff line number Diff line change
@@ -0,0 +1,4 @@
[develop]
script_dir=$base/lib/game_controller_hl
[install]
install_scripts=$base/lib/game_controller_hl
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@

from setuptools import find_packages, setup

package_name = 'game_controller_humanoid'
package_name = 'game_controller_hl'

setup(
name=package_name,
Expand All @@ -28,7 +28,7 @@
tests_require=['pytest'],
entry_points={
'console_scripts': [
'game_controller = game_controller_humanoid.receiver:main',
'game_controller = game_controller_hl.receiver:main',
],
}
)
Original file line number Diff line number Diff line change
Expand Up @@ -6,11 +6,11 @@
from rclpy.node import Node
from rclpy.parameter import Parameter

from game_controller_humanoid.gamestate import GameStateStruct, TeamInfoStruct
from game_controller_humanoid.utils import get_parameters_from_other_node
from game_controller_humanoid.receiver import GameStateReceiver
from game_controller_hl.gamestate import GameStateStruct, TeamInfoStruct
from game_controller_hl.utils import get_parameters_from_other_node
from game_controller_hl.receiver import GameStateReceiver

from game_controller_humanoid_interfaces.msg import GameState
from game_controller_hl_interfaces.msg import GameState


def test_get_parameters_from_other_node():
Expand Down
File renamed without changes.
Original file line number Diff line number Diff line change
@@ -1,5 +1,5 @@
cmake_minimum_required(VERSION 3.5)
project(game_controller_humanoid_interfaces)
project(game_controller_hl_interfaces)

find_package(ament_cmake REQUIRED)
find_package(rosidl_default_generators REQUIRED)
Expand Down
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>game_controller_humanoid_interfaces</name>
<name>game_controller_hl_interfaces</name>
<version>0.0.1</version>
<description>RoboCup Humanoid League Game Controller Messages</description>

Expand Down
9 changes: 0 additions & 9 deletions game_controller_humanoid/launch/game_controller.launch

This file was deleted.

4 changes: 0 additions & 4 deletions game_controller_humanoid/setup.cfg

This file was deleted.

0 comments on commit fae7ff6

Please sign in to comment.