Skip to content

Commit

Permalink
minor changes allowing example nodes to be run
Browse files Browse the repository at this point in the history
  • Loading branch information
alberthli committed Jun 20, 2024
1 parent 6d29e73 commit 92b231b
Show file tree
Hide file tree
Showing 3 changed files with 6 additions and 4 deletions.
6 changes: 3 additions & 3 deletions obelisk_ws/src/example_cpp/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -14,11 +14,11 @@ find_package(ament_cmake REQUIRED)
find_package(rclcpp REQUIRED)
find_package(std_msgs REQUIRED)

add_executable(talker src/example_cpp.cpp)
ament_target_dependencies(talker rclcpp std_msgs)
add_executable(example_cpp src/example_cpp.cpp)
ament_target_dependencies(example_cpp rclcpp std_msgs)

install(TARGETS
talker
example_cpp
DESTINATION lib/${PROJECT_NAME})

ament_package()
3 changes: 2 additions & 1 deletion obelisk_ws/src/example_py/example_py/example_py.py
Original file line number Diff line number Diff line change
@@ -1,8 +1,9 @@
from typing import Any, Self
from typing import Any

import rclpy
from rclpy.node import Node
from std_msgs.msg import String
from typing_extensions import Self


class MinimalPublisher(Node):
Expand Down
1 change: 1 addition & 0 deletions pixi.toml
Original file line number Diff line number Diff line change
Expand Up @@ -70,6 +70,7 @@ colcon-common-extensions = "*"

# TODO(ahl): this was just a test to see if we could install many
# prune these away to a true minimal set later
# [NOTE] on humble, we should expect python 3.10
ros-humble-control-msgs = "*"
ros-humble-xacro = "*"
ros-humble-angles = "*"
Expand Down

0 comments on commit 92b231b

Please sign in to comment.