Skip to content

Commit

Permalink
Update to build offboard_control.py
Browse files Browse the repository at this point in the history
  • Loading branch information
itskalvik authored and beniaminopozzan committed Mar 10, 2024
1 parent 2d56cb6 commit 86e9aeb
Show file tree
Hide file tree
Showing 4 changed files with 16 additions and 0 deletions.
14 changes: 14 additions & 0 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -24,6 +24,7 @@ find_package(geometry_msgs REQUIRED)
find_package(px4_msgs REQUIRED)
find_package(rclcpp REQUIRED)
find_package(sensor_msgs REQUIRED)
find_package(rclpy REQUIRED)

#################
# Setup targets #
Expand Down Expand Up @@ -111,4 +112,17 @@ if(BUILD_TESTING)
ament_lint_auto_find_test_dependencies()
endif()

###########
# Python ##
###########

# Install Python modules
ament_python_install_package(${PROJECT_NAME})

# Install Python executables
install(PROGRAMS
src/examples/offboard_py/offboard_control.py
DESTINATION lib/${PROJECT_NAME}
)

ament_package()
Empty file added px4_ros_com/__init__.py
Empty file.
Empty file added px4_ros_com/module_to_import.py
Empty file.
2 changes: 2 additions & 0 deletions src/examples/offboard_py/offboard_control.py
100644 → 100755
Original file line number Diff line number Diff line change
@@ -1,3 +1,5 @@
#!/usr/bin/env python3

import rclpy
from rclpy.node import Node
from rclpy.qos import QoSProfile, ReliabilityPolicy, HistoryPolicy, DurabilityPolicy
Expand Down

0 comments on commit 86e9aeb

Please sign in to comment.