surface
This commit is contained in:
Binary file not shown.
Binary file not shown.
45
ros2_ws/src/arduino_bridge/arduino_bridge/arduino_bridge.py
Normal file
45
ros2_ws/src/arduino_bridge/arduino_bridge/arduino_bridge.py
Normal file
@@ -0,0 +1,45 @@
|
||||
import rclpy
|
||||
from rclpy.node import Node
|
||||
from std_msgs.msg import Int32
|
||||
import serial
|
||||
|
||||
class ArduinoBridge(Node):
|
||||
def __init__(self):
|
||||
super().__init__('arduino_bridge')
|
||||
|
||||
self.publisher_ = self.create_publisher(Int32, 'water_level', 10)
|
||||
self.subscription = self.create_subscription(
|
||||
Int32,
|
||||
'servo_angle',
|
||||
self.servo_callback,
|
||||
10)
|
||||
|
||||
self.ser = serial.Serial('/dev/ttyUSB0', 9600, timeout=1)
|
||||
|
||||
self.create_timer(0.5, self.read_sensor)
|
||||
|
||||
def read_sensor(self):
|
||||
if self.ser.in_waiting > 0:
|
||||
line = self.ser.readline().decode().strip()
|
||||
if line.startswith('WATER:'):
|
||||
level = int(line.split(':')[1])
|
||||
msg = Int32()
|
||||
msg.data = level
|
||||
self.publisher_.publish(msg)
|
||||
self.get_logger().info(f'Water level: {level}')
|
||||
|
||||
def servo_callback(self, msg):
|
||||
angle = str(msg.data) + '\n'
|
||||
self.ser.write(angle.encode())
|
||||
self.get_logger().info(f'Sent servo angle: {msg.data}')
|
||||
|
||||
def main(args=None):
|
||||
rclpy.init(args=args)
|
||||
node = ArduinoBridge()
|
||||
rclpy.spin(node)
|
||||
node.destroy_node()
|
||||
rclpy.shutdown()
|
||||
|
||||
if __name__ == '__main__':
|
||||
main()
|
||||
|
||||
1
ros2_ws/src/arduino_bridge/build/.built_by
Normal file
1
ros2_ws/src/arduino_bridge/build/.built_by
Normal file
@@ -0,0 +1 @@
|
||||
colcon
|
||||
0
ros2_ws/src/arduino_bridge/build/COLCON_IGNORE
Normal file
0
ros2_ws/src/arduino_bridge/build/COLCON_IGNORE
Normal file
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/arduino_bridge
Symbolic link
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/arduino_bridge
Symbolic link
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/arduino_bridge
|
||||
@@ -0,0 +1,12 @@
|
||||
Metadata-Version: 2.1
|
||||
Name: arduino-bridge
|
||||
Version: 0.0.0
|
||||
Summary: TODO: Package description
|
||||
Home-page: UNKNOWN
|
||||
Maintainer: koray
|
||||
Maintainer-email: koray@todo.todo
|
||||
License: TODO: License declaration
|
||||
Platform: UNKNOWN
|
||||
|
||||
UNKNOWN
|
||||
|
||||
@@ -0,0 +1,13 @@
|
||||
package.xml
|
||||
setup.cfg
|
||||
setup.py
|
||||
arduino_bridge/__init__.py
|
||||
arduino_bridge/arduino_bridge.py
|
||||
arduino_bridge.egg-info/PKG-INFO
|
||||
arduino_bridge.egg-info/SOURCES.txt
|
||||
arduino_bridge.egg-info/dependency_links.txt
|
||||
arduino_bridge.egg-info/entry_points.txt
|
||||
arduino_bridge.egg-info/requires.txt
|
||||
arduino_bridge.egg-info/top_level.txt
|
||||
arduino_bridge.egg-info/zip-safe
|
||||
resource/arduino_bridge
|
||||
@@ -0,0 +1 @@
|
||||
|
||||
@@ -0,0 +1,3 @@
|
||||
[console_scripts]
|
||||
arduino_bridge = arduino_bridge.arduino_bridge:main
|
||||
|
||||
@@ -0,0 +1 @@
|
||||
setuptools
|
||||
@@ -0,0 +1 @@
|
||||
arduino_bridge
|
||||
@@ -0,0 +1 @@
|
||||
|
||||
@@ -0,0 +1,45 @@
|
||||
import rclpy
|
||||
from rclpy.node import Node
|
||||
from std_msgs.msg import Int32
|
||||
import serial
|
||||
|
||||
class ArduinoBridge(Node):
|
||||
def __init__(self):
|
||||
super().__init__('arduino_bridge')
|
||||
|
||||
self.publisher_ = self.create_publisher(Int32, 'water_level', 10)
|
||||
self.subscription = self.create_subscription(
|
||||
Int32,
|
||||
'servo_angle',
|
||||
self.servo_callback,
|
||||
10)
|
||||
|
||||
self.ser = serial.Serial('/dev/ttyUSB0', 9600, timeout=1)
|
||||
|
||||
self.create_timer(0.5, self.read_sensor)
|
||||
|
||||
def read_sensor(self):
|
||||
if self.ser.in_waiting > 0:
|
||||
line = self.ser.readline().decode().strip()
|
||||
if line.startswith('WATER:'):
|
||||
level = int(line.split(':')[1])
|
||||
msg = Int32()
|
||||
msg.data = level
|
||||
self.publisher_.publish(msg)
|
||||
self.get_logger().info(f'Water level: {level}')
|
||||
|
||||
def servo_callback(self, msg):
|
||||
angle = str(msg.data) + '\n'
|
||||
self.ser.write(angle.encode())
|
||||
self.get_logger().info(f'Sent servo angle: {msg.data}')
|
||||
|
||||
def main(args=None):
|
||||
rclpy.init(args=args)
|
||||
node = ArduinoBridge()
|
||||
rclpy.spin(node)
|
||||
node.destroy_node()
|
||||
rclpy.shutdown()
|
||||
|
||||
if __name__ == '__main__':
|
||||
main()
|
||||
|
||||
@@ -0,0 +1 @@
|
||||
0
|
||||
@@ -0,0 +1 @@
|
||||
# generated from colcon_core/shell/template/command_prefix.sh.em
|
||||
@@ -0,0 +1,29 @@
|
||||
AMENT_PREFIX_PATH=/opt/ros/humble
|
||||
COLCON=1
|
||||
CYCLONEDDS_URI=file:///etc/cyclonedds/config.xml
|
||||
DEBIAN_FRONTEND=noninteractive
|
||||
DISPLAY=:0
|
||||
HOME=/home/koray
|
||||
HOSTNAME=983a254c47a9
|
||||
LANG=C.UTF-8
|
||||
LC_ALL=C.UTF-8
|
||||
LD_LIBRARY_PATH=/opt/ros/humble/opt/rviz_ogre_vendor/lib:/opt/ros/humble/lib/x86_64-linux-gnu:/opt/ros/humble/lib
|
||||
LESSCLOSE=/usr/bin/lesspipe %s %s
|
||||
LESSOPEN=| /usr/bin/lesspipe %s
|
||||
LIBVA_DRIVER_NAME=i965
|
||||
LS_COLORS=rs=0:di=01;34:ln=01;36:mh=00:pi=40;33:so=01;35:do=01;35:bd=40;33;01:cd=40;33;01:or=40;31;01:mi=00:su=37;41:sg=30;43:ca=30;41:tw=30;42:ow=34;42:st=37;44:ex=01;32:*.tar=01;31:*.tgz=01;31:*.arc=01;31:*.arj=01;31:*.taz=01;31:*.lha=01;31:*.lz4=01;31:*.lzh=01;31:*.lzma=01;31:*.tlz=01;31:*.txz=01;31:*.tzo=01;31:*.t7z=01;31:*.zip=01;31:*.z=01;31:*.dz=01;31:*.gz=01;31:*.lrz=01;31:*.lz=01;31:*.lzo=01;31:*.xz=01;31:*.zst=01;31:*.tzst=01;31:*.bz2=01;31:*.bz=01;31:*.tbz=01;31:*.tbz2=01;31:*.tz=01;31:*.deb=01;31:*.rpm=01;31:*.jar=01;31:*.war=01;31:*.ear=01;31:*.sar=01;31:*.rar=01;31:*.alz=01;31:*.ace=01;31:*.zoo=01;31:*.cpio=01;31:*.7z=01;31:*.rz=01;31:*.cab=01;31:*.wim=01;31:*.swm=01;31:*.dwm=01;31:*.esd=01;31:*.jpg=01;35:*.jpeg=01;35:*.mjpg=01;35:*.mjpeg=01;35:*.gif=01;35:*.bmp=01;35:*.pbm=01;35:*.pgm=01;35:*.ppm=01;35:*.tga=01;35:*.xbm=01;35:*.xpm=01;35:*.tif=01;35:*.tiff=01;35:*.png=01;35:*.svg=01;35:*.svgz=01;35:*.mng=01;35:*.pcx=01;35:*.mov=01;35:*.mpg=01;35:*.mpeg=01;35:*.m2v=01;35:*.mkv=01;35:*.webm=01;35:*.webp=01;35:*.ogm=01;35:*.mp4=01;35:*.m4v=01;35:*.mp4v=01;35:*.vob=01;35:*.qt=01;35:*.nuv=01;35:*.wmv=01;35:*.asf=01;35:*.rm=01;35:*.rmvb=01;35:*.flc=01;35:*.avi=01;35:*.fli=01;35:*.flv=01;35:*.gl=01;35:*.dl=01;35:*.xcf=01;35:*.xwd=01;35:*.yuv=01;35:*.cgm=01;35:*.emf=01;35:*.ogv=01;35:*.ogx=01;35:*.aac=00;36:*.au=00;36:*.flac=00;36:*.m4a=00;36:*.mid=00;36:*.midi=00;36:*.mka=00;36:*.mp3=00;36:*.mpc=00;36:*.ogg=00;36:*.ra=00;36:*.wav=00;36:*.oga=00;36:*.opus=00;36:*.spx=00;36:*.xspf=00;36:
|
||||
MESA_LOADER_DRIVER_OVERRIDE=iris
|
||||
OLDPWD=/home/koray/ros2_ws
|
||||
PATH=/opt/ros/humble/bin:/usr/local/sbin:/usr/local/bin:/usr/sbin:/usr/bin:/sbin:/bin
|
||||
PWD=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
PYTHONPATH=/opt/ros/humble/lib/python3.10/site-packages:/opt/ros/humble/local/lib/python3.10/dist-packages
|
||||
QT_QPA_PLATFORM=xcb
|
||||
RMW_IMPLEMENTATION=rmw_cyclonedds_cpp
|
||||
ROS_DISTRO=humble
|
||||
ROS_LOCALHOST_ONLY=0
|
||||
ROS_PYTHON_VERSION=3
|
||||
ROS_VERSION=2
|
||||
SHELL=/bin/bash
|
||||
SHLVL=1
|
||||
TERM=xterm
|
||||
_=/usr/bin/colcon
|
||||
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/package.xml
Symbolic link
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/package.xml
Symbolic link
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/package.xml
|
||||
Binary file not shown.
@@ -0,0 +1,4 @@
|
||||
import sys
|
||||
if sys.prefix == '/usr':
|
||||
sys.real_prefix = sys.prefix
|
||||
sys.prefix = sys.exec_prefix = '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge'
|
||||
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/resource/arduino_bridge
|
||||
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/setup.cfg
Symbolic link
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/setup.cfg
Symbolic link
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/setup.cfg
|
||||
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/setup.py
Symbolic link
1
ros2_ws/src/arduino_bridge/build/arduino_bridge/setup.py
Symbolic link
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/setup.py
|
||||
@@ -0,0 +1 @@
|
||||
prepend-non-duplicate;PYTHONPATH;/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_powershell/shell/template/hook_prepend_value.ps1.em
|
||||
|
||||
colcon_prepend_unique_value PYTHONPATH "$env:COLCON_CURRENT_PREFIX\/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge"
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_core/shell/template/hook_prepend_value.sh.em
|
||||
|
||||
_colcon_prepend_unique_value PYTHONPATH "/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge"
|
||||
@@ -0,0 +1 @@
|
||||
isolated
|
||||
0
ros2_ws/src/arduino_bridge/install/COLCON_IGNORE
Normal file
0
ros2_ws/src/arduino_bridge/install/COLCON_IGNORE
Normal file
407
ros2_ws/src/arduino_bridge/install/_local_setup_util_ps1.py
Normal file
407
ros2_ws/src/arduino_bridge/install/_local_setup_util_ps1.py
Normal file
@@ -0,0 +1,407 @@
|
||||
# Copyright 2016-2019 Dirk Thomas
|
||||
# Licensed under the Apache License, Version 2.0
|
||||
|
||||
import argparse
|
||||
from collections import OrderedDict
|
||||
import os
|
||||
from pathlib import Path
|
||||
import sys
|
||||
|
||||
|
||||
FORMAT_STR_COMMENT_LINE = '# {comment}'
|
||||
FORMAT_STR_SET_ENV_VAR = 'Set-Item -Path "Env:{name}" -Value "{value}"'
|
||||
FORMAT_STR_USE_ENV_VAR = '$env:{name}'
|
||||
FORMAT_STR_INVOKE_SCRIPT = '_colcon_prefix_powershell_source_script "{script_path}"' # noqa: E501
|
||||
FORMAT_STR_REMOVE_LEADING_SEPARATOR = '' # noqa: E501
|
||||
FORMAT_STR_REMOVE_TRAILING_SEPARATOR = '' # noqa: E501
|
||||
|
||||
DSV_TYPE_APPEND_NON_DUPLICATE = 'append-non-duplicate'
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE = 'prepend-non-duplicate'
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS = 'prepend-non-duplicate-if-exists'
|
||||
DSV_TYPE_SET = 'set'
|
||||
DSV_TYPE_SET_IF_UNSET = 'set-if-unset'
|
||||
DSV_TYPE_SOURCE = 'source'
|
||||
|
||||
|
||||
def main(argv=sys.argv[1:]): # noqa: D103
|
||||
parser = argparse.ArgumentParser(
|
||||
description='Output shell commands for the packages in topological '
|
||||
'order')
|
||||
parser.add_argument(
|
||||
'primary_extension',
|
||||
help='The file extension of the primary shell')
|
||||
parser.add_argument(
|
||||
'additional_extension', nargs='?',
|
||||
help='The additional file extension to be considered')
|
||||
parser.add_argument(
|
||||
'--merged-install', action='store_true',
|
||||
help='All install prefixes are merged into a single location')
|
||||
args = parser.parse_args(argv)
|
||||
|
||||
packages = get_packages(Path(__file__).parent, args.merged_install)
|
||||
|
||||
ordered_packages = order_packages(packages)
|
||||
for pkg_name in ordered_packages:
|
||||
if _include_comments():
|
||||
print(
|
||||
FORMAT_STR_COMMENT_LINE.format_map(
|
||||
{'comment': 'Package: ' + pkg_name}))
|
||||
prefix = os.path.abspath(os.path.dirname(__file__))
|
||||
if not args.merged_install:
|
||||
prefix = os.path.join(prefix, pkg_name)
|
||||
for line in get_commands(
|
||||
pkg_name, prefix, args.primary_extension,
|
||||
args.additional_extension
|
||||
):
|
||||
print(line)
|
||||
|
||||
for line in _remove_ending_separators():
|
||||
print(line)
|
||||
|
||||
|
||||
def get_packages(prefix_path, merged_install):
|
||||
"""
|
||||
Find packages based on colcon-specific files created during installation.
|
||||
|
||||
:param Path prefix_path: The install prefix path of all packages
|
||||
:param bool merged_install: The flag if the packages are all installed
|
||||
directly in the prefix or if each package is installed in a subdirectory
|
||||
named after the package
|
||||
:returns: A mapping from the package name to the set of runtime
|
||||
dependencies
|
||||
:rtype: dict
|
||||
"""
|
||||
packages = {}
|
||||
# since importing colcon_core isn't feasible here the following constant
|
||||
# must match colcon_core.location.get_relative_package_index_path()
|
||||
subdirectory = 'share/colcon-core/packages'
|
||||
if merged_install:
|
||||
# return if workspace is empty
|
||||
if not (prefix_path / subdirectory).is_dir():
|
||||
return packages
|
||||
# find all files in the subdirectory
|
||||
for p in (prefix_path / subdirectory).iterdir():
|
||||
if not p.is_file():
|
||||
continue
|
||||
if p.name.startswith('.'):
|
||||
continue
|
||||
add_package_runtime_dependencies(p, packages)
|
||||
else:
|
||||
# for each subdirectory look for the package specific file
|
||||
for p in prefix_path.iterdir():
|
||||
if not p.is_dir():
|
||||
continue
|
||||
if p.name.startswith('.'):
|
||||
continue
|
||||
p = p / subdirectory / p.name
|
||||
if p.is_file():
|
||||
add_package_runtime_dependencies(p, packages)
|
||||
|
||||
# remove unknown dependencies
|
||||
pkg_names = set(packages.keys())
|
||||
for k in packages.keys():
|
||||
packages[k] = {d for d in packages[k] if d in pkg_names}
|
||||
|
||||
return packages
|
||||
|
||||
|
||||
def add_package_runtime_dependencies(path, packages):
|
||||
"""
|
||||
Check the path and if it exists extract the packages runtime dependencies.
|
||||
|
||||
:param Path path: The resource file containing the runtime dependencies
|
||||
:param dict packages: A mapping from package names to the sets of runtime
|
||||
dependencies to add to
|
||||
"""
|
||||
content = path.read_text()
|
||||
dependencies = set(content.split(os.pathsep) if content else [])
|
||||
packages[path.name] = dependencies
|
||||
|
||||
|
||||
def order_packages(packages):
|
||||
"""
|
||||
Order packages topologically.
|
||||
|
||||
:param dict packages: A mapping from package name to the set of runtime
|
||||
dependencies
|
||||
:returns: The package names
|
||||
:rtype: list
|
||||
"""
|
||||
# select packages with no dependencies in alphabetical order
|
||||
to_be_ordered = list(packages.keys())
|
||||
ordered = []
|
||||
while to_be_ordered:
|
||||
pkg_names_without_deps = [
|
||||
name for name in to_be_ordered if not packages[name]]
|
||||
if not pkg_names_without_deps:
|
||||
reduce_cycle_set(packages)
|
||||
raise RuntimeError(
|
||||
'Circular dependency between: ' + ', '.join(sorted(packages)))
|
||||
pkg_names_without_deps.sort()
|
||||
pkg_name = pkg_names_without_deps[0]
|
||||
to_be_ordered.remove(pkg_name)
|
||||
ordered.append(pkg_name)
|
||||
# remove item from dependency lists
|
||||
for k in list(packages.keys()):
|
||||
if pkg_name in packages[k]:
|
||||
packages[k].remove(pkg_name)
|
||||
return ordered
|
||||
|
||||
|
||||
def reduce_cycle_set(packages):
|
||||
"""
|
||||
Reduce the set of packages to the ones part of the circular dependency.
|
||||
|
||||
:param dict packages: A mapping from package name to the set of runtime
|
||||
dependencies which is modified in place
|
||||
"""
|
||||
last_depended = None
|
||||
while len(packages) > 0:
|
||||
# get all remaining dependencies
|
||||
depended = set()
|
||||
for pkg_name, dependencies in packages.items():
|
||||
depended = depended.union(dependencies)
|
||||
# remove all packages which are not dependent on
|
||||
for name in list(packages.keys()):
|
||||
if name not in depended:
|
||||
del packages[name]
|
||||
if last_depended:
|
||||
# if remaining packages haven't changed return them
|
||||
if last_depended == depended:
|
||||
return packages.keys()
|
||||
# otherwise reduce again
|
||||
last_depended = depended
|
||||
|
||||
|
||||
def _include_comments():
|
||||
# skipping comment lines when COLCON_TRACE is not set speeds up the
|
||||
# processing especially on Windows
|
||||
return bool(os.environ.get('COLCON_TRACE'))
|
||||
|
||||
|
||||
def get_commands(pkg_name, prefix, primary_extension, additional_extension):
|
||||
commands = []
|
||||
package_dsv_path = os.path.join(prefix, 'share', pkg_name, 'package.dsv')
|
||||
if os.path.exists(package_dsv_path):
|
||||
commands += process_dsv_file(
|
||||
package_dsv_path, prefix, primary_extension, additional_extension)
|
||||
return commands
|
||||
|
||||
|
||||
def process_dsv_file(
|
||||
dsv_path, prefix, primary_extension=None, additional_extension=None
|
||||
):
|
||||
commands = []
|
||||
if _include_comments():
|
||||
commands.append(FORMAT_STR_COMMENT_LINE.format_map({'comment': dsv_path}))
|
||||
with open(dsv_path, 'r') as h:
|
||||
content = h.read()
|
||||
lines = content.splitlines()
|
||||
|
||||
basenames = OrderedDict()
|
||||
for i, line in enumerate(lines):
|
||||
# skip over empty or whitespace-only lines
|
||||
if not line.strip():
|
||||
continue
|
||||
# skip over comments
|
||||
if line.startswith('#'):
|
||||
continue
|
||||
try:
|
||||
type_, remainder = line.split(';', 1)
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"Line %d in '%s' doesn't contain a semicolon separating the "
|
||||
'type from the arguments' % (i + 1, dsv_path))
|
||||
if type_ != DSV_TYPE_SOURCE:
|
||||
# handle non-source lines
|
||||
try:
|
||||
commands += handle_dsv_types_except_source(
|
||||
type_, remainder, prefix)
|
||||
except RuntimeError as e:
|
||||
raise RuntimeError(
|
||||
"Line %d in '%s' %s" % (i + 1, dsv_path, e)) from e
|
||||
else:
|
||||
# group remaining source lines by basename
|
||||
path_without_ext, ext = os.path.splitext(remainder)
|
||||
if path_without_ext not in basenames:
|
||||
basenames[path_without_ext] = set()
|
||||
assert ext.startswith('.')
|
||||
ext = ext[1:]
|
||||
if ext in (primary_extension, additional_extension):
|
||||
basenames[path_without_ext].add(ext)
|
||||
|
||||
# add the dsv extension to each basename if the file exists
|
||||
for basename, extensions in basenames.items():
|
||||
if not os.path.isabs(basename):
|
||||
basename = os.path.join(prefix, basename)
|
||||
if os.path.exists(basename + '.dsv'):
|
||||
extensions.add('dsv')
|
||||
|
||||
for basename, extensions in basenames.items():
|
||||
if not os.path.isabs(basename):
|
||||
basename = os.path.join(prefix, basename)
|
||||
if 'dsv' in extensions:
|
||||
# process dsv files recursively
|
||||
commands += process_dsv_file(
|
||||
basename + '.dsv', prefix, primary_extension=primary_extension,
|
||||
additional_extension=additional_extension)
|
||||
elif primary_extension in extensions and len(extensions) == 1:
|
||||
# source primary-only files
|
||||
commands += [
|
||||
FORMAT_STR_INVOKE_SCRIPT.format_map({
|
||||
'prefix': prefix,
|
||||
'script_path': basename + '.' + primary_extension})]
|
||||
elif additional_extension in extensions:
|
||||
# source non-primary files
|
||||
commands += [
|
||||
FORMAT_STR_INVOKE_SCRIPT.format_map({
|
||||
'prefix': prefix,
|
||||
'script_path': basename + '.' + additional_extension})]
|
||||
|
||||
return commands
|
||||
|
||||
|
||||
def handle_dsv_types_except_source(type_, remainder, prefix):
|
||||
commands = []
|
||||
if type_ in (DSV_TYPE_SET, DSV_TYPE_SET_IF_UNSET):
|
||||
try:
|
||||
env_name, value = remainder.split(';', 1)
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"doesn't contain a semicolon separating the environment name "
|
||||
'from the value')
|
||||
try_prefixed_value = os.path.join(prefix, value) if value else prefix
|
||||
if os.path.exists(try_prefixed_value):
|
||||
value = try_prefixed_value
|
||||
if type_ == DSV_TYPE_SET:
|
||||
commands += _set(env_name, value)
|
||||
elif type_ == DSV_TYPE_SET_IF_UNSET:
|
||||
commands += _set_if_unset(env_name, value)
|
||||
else:
|
||||
assert False
|
||||
elif type_ in (
|
||||
DSV_TYPE_APPEND_NON_DUPLICATE,
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE,
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS
|
||||
):
|
||||
try:
|
||||
env_name_and_values = remainder.split(';')
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"doesn't contain a semicolon separating the environment name "
|
||||
'from the values')
|
||||
env_name = env_name_and_values[0]
|
||||
values = env_name_and_values[1:]
|
||||
for value in values:
|
||||
if not value:
|
||||
value = prefix
|
||||
elif not os.path.isabs(value):
|
||||
value = os.path.join(prefix, value)
|
||||
if (
|
||||
type_ == DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS and
|
||||
not os.path.exists(value)
|
||||
):
|
||||
comment = f'skip extending {env_name} with not existing ' \
|
||||
f'path: {value}'
|
||||
if _include_comments():
|
||||
commands.append(
|
||||
FORMAT_STR_COMMENT_LINE.format_map({'comment': comment}))
|
||||
elif type_ == DSV_TYPE_APPEND_NON_DUPLICATE:
|
||||
commands += _append_unique_value(env_name, value)
|
||||
else:
|
||||
commands += _prepend_unique_value(env_name, value)
|
||||
else:
|
||||
raise RuntimeError(
|
||||
'contains an unknown environment hook type: ' + type_)
|
||||
return commands
|
||||
|
||||
|
||||
env_state = {}
|
||||
|
||||
|
||||
def _append_unique_value(name, value):
|
||||
global env_state
|
||||
if name not in env_state:
|
||||
if os.environ.get(name):
|
||||
env_state[name] = set(os.environ[name].split(os.pathsep))
|
||||
else:
|
||||
env_state[name] = set()
|
||||
# append even if the variable has not been set yet, in case a shell script sets the
|
||||
# same variable without the knowledge of this Python script.
|
||||
# later _remove_ending_separators() will cleanup any unintentional leading separator
|
||||
extend = FORMAT_STR_USE_ENV_VAR.format_map({'name': name}) + os.pathsep
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': extend + value})
|
||||
if value not in env_state[name]:
|
||||
env_state[name].add(value)
|
||||
else:
|
||||
if not _include_comments():
|
||||
return []
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
def _prepend_unique_value(name, value):
|
||||
global env_state
|
||||
if name not in env_state:
|
||||
if os.environ.get(name):
|
||||
env_state[name] = set(os.environ[name].split(os.pathsep))
|
||||
else:
|
||||
env_state[name] = set()
|
||||
# prepend even if the variable has not been set yet, in case a shell script sets the
|
||||
# same variable without the knowledge of this Python script.
|
||||
# later _remove_ending_separators() will cleanup any unintentional trailing separator
|
||||
extend = os.pathsep + FORMAT_STR_USE_ENV_VAR.format_map({'name': name})
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value + extend})
|
||||
if value not in env_state[name]:
|
||||
env_state[name].add(value)
|
||||
else:
|
||||
if not _include_comments():
|
||||
return []
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
# generate commands for removing prepended underscores
|
||||
def _remove_ending_separators():
|
||||
# do nothing if the shell extension does not implement the logic
|
||||
if FORMAT_STR_REMOVE_TRAILING_SEPARATOR is None:
|
||||
return []
|
||||
|
||||
global env_state
|
||||
commands = []
|
||||
for name in env_state:
|
||||
# skip variables that already had values before this script started prepending
|
||||
if name in os.environ:
|
||||
continue
|
||||
commands += [
|
||||
FORMAT_STR_REMOVE_LEADING_SEPARATOR.format_map({'name': name}),
|
||||
FORMAT_STR_REMOVE_TRAILING_SEPARATOR.format_map({'name': name})]
|
||||
return commands
|
||||
|
||||
|
||||
def _set(name, value):
|
||||
global env_state
|
||||
env_state[name] = value
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value})
|
||||
return [line]
|
||||
|
||||
|
||||
def _set_if_unset(name, value):
|
||||
global env_state
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value})
|
||||
if env_state.get(name, os.environ.get(name)):
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
if __name__ == '__main__': # pragma: no cover
|
||||
try:
|
||||
rc = main()
|
||||
except RuntimeError as e:
|
||||
print(str(e), file=sys.stderr)
|
||||
rc = 1
|
||||
sys.exit(rc)
|
||||
407
ros2_ws/src/arduino_bridge/install/_local_setup_util_sh.py
Normal file
407
ros2_ws/src/arduino_bridge/install/_local_setup_util_sh.py
Normal file
@@ -0,0 +1,407 @@
|
||||
# Copyright 2016-2019 Dirk Thomas
|
||||
# Licensed under the Apache License, Version 2.0
|
||||
|
||||
import argparse
|
||||
from collections import OrderedDict
|
||||
import os
|
||||
from pathlib import Path
|
||||
import sys
|
||||
|
||||
|
||||
FORMAT_STR_COMMENT_LINE = '# {comment}'
|
||||
FORMAT_STR_SET_ENV_VAR = 'export {name}="{value}"'
|
||||
FORMAT_STR_USE_ENV_VAR = '${name}'
|
||||
FORMAT_STR_INVOKE_SCRIPT = 'COLCON_CURRENT_PREFIX="{prefix}" _colcon_prefix_sh_source_script "{script_path}"' # noqa: E501
|
||||
FORMAT_STR_REMOVE_LEADING_SEPARATOR = 'if [ "$(echo -n ${name} | head -c 1)" = ":" ]; then export {name}=${{{name}#?}} ; fi' # noqa: E501
|
||||
FORMAT_STR_REMOVE_TRAILING_SEPARATOR = 'if [ "$(echo -n ${name} | tail -c 1)" = ":" ]; then export {name}=${{{name}%?}} ; fi' # noqa: E501
|
||||
|
||||
DSV_TYPE_APPEND_NON_DUPLICATE = 'append-non-duplicate'
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE = 'prepend-non-duplicate'
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS = 'prepend-non-duplicate-if-exists'
|
||||
DSV_TYPE_SET = 'set'
|
||||
DSV_TYPE_SET_IF_UNSET = 'set-if-unset'
|
||||
DSV_TYPE_SOURCE = 'source'
|
||||
|
||||
|
||||
def main(argv=sys.argv[1:]): # noqa: D103
|
||||
parser = argparse.ArgumentParser(
|
||||
description='Output shell commands for the packages in topological '
|
||||
'order')
|
||||
parser.add_argument(
|
||||
'primary_extension',
|
||||
help='The file extension of the primary shell')
|
||||
parser.add_argument(
|
||||
'additional_extension', nargs='?',
|
||||
help='The additional file extension to be considered')
|
||||
parser.add_argument(
|
||||
'--merged-install', action='store_true',
|
||||
help='All install prefixes are merged into a single location')
|
||||
args = parser.parse_args(argv)
|
||||
|
||||
packages = get_packages(Path(__file__).parent, args.merged_install)
|
||||
|
||||
ordered_packages = order_packages(packages)
|
||||
for pkg_name in ordered_packages:
|
||||
if _include_comments():
|
||||
print(
|
||||
FORMAT_STR_COMMENT_LINE.format_map(
|
||||
{'comment': 'Package: ' + pkg_name}))
|
||||
prefix = os.path.abspath(os.path.dirname(__file__))
|
||||
if not args.merged_install:
|
||||
prefix = os.path.join(prefix, pkg_name)
|
||||
for line in get_commands(
|
||||
pkg_name, prefix, args.primary_extension,
|
||||
args.additional_extension
|
||||
):
|
||||
print(line)
|
||||
|
||||
for line in _remove_ending_separators():
|
||||
print(line)
|
||||
|
||||
|
||||
def get_packages(prefix_path, merged_install):
|
||||
"""
|
||||
Find packages based on colcon-specific files created during installation.
|
||||
|
||||
:param Path prefix_path: The install prefix path of all packages
|
||||
:param bool merged_install: The flag if the packages are all installed
|
||||
directly in the prefix or if each package is installed in a subdirectory
|
||||
named after the package
|
||||
:returns: A mapping from the package name to the set of runtime
|
||||
dependencies
|
||||
:rtype: dict
|
||||
"""
|
||||
packages = {}
|
||||
# since importing colcon_core isn't feasible here the following constant
|
||||
# must match colcon_core.location.get_relative_package_index_path()
|
||||
subdirectory = 'share/colcon-core/packages'
|
||||
if merged_install:
|
||||
# return if workspace is empty
|
||||
if not (prefix_path / subdirectory).is_dir():
|
||||
return packages
|
||||
# find all files in the subdirectory
|
||||
for p in (prefix_path / subdirectory).iterdir():
|
||||
if not p.is_file():
|
||||
continue
|
||||
if p.name.startswith('.'):
|
||||
continue
|
||||
add_package_runtime_dependencies(p, packages)
|
||||
else:
|
||||
# for each subdirectory look for the package specific file
|
||||
for p in prefix_path.iterdir():
|
||||
if not p.is_dir():
|
||||
continue
|
||||
if p.name.startswith('.'):
|
||||
continue
|
||||
p = p / subdirectory / p.name
|
||||
if p.is_file():
|
||||
add_package_runtime_dependencies(p, packages)
|
||||
|
||||
# remove unknown dependencies
|
||||
pkg_names = set(packages.keys())
|
||||
for k in packages.keys():
|
||||
packages[k] = {d for d in packages[k] if d in pkg_names}
|
||||
|
||||
return packages
|
||||
|
||||
|
||||
def add_package_runtime_dependencies(path, packages):
|
||||
"""
|
||||
Check the path and if it exists extract the packages runtime dependencies.
|
||||
|
||||
:param Path path: The resource file containing the runtime dependencies
|
||||
:param dict packages: A mapping from package names to the sets of runtime
|
||||
dependencies to add to
|
||||
"""
|
||||
content = path.read_text()
|
||||
dependencies = set(content.split(os.pathsep) if content else [])
|
||||
packages[path.name] = dependencies
|
||||
|
||||
|
||||
def order_packages(packages):
|
||||
"""
|
||||
Order packages topologically.
|
||||
|
||||
:param dict packages: A mapping from package name to the set of runtime
|
||||
dependencies
|
||||
:returns: The package names
|
||||
:rtype: list
|
||||
"""
|
||||
# select packages with no dependencies in alphabetical order
|
||||
to_be_ordered = list(packages.keys())
|
||||
ordered = []
|
||||
while to_be_ordered:
|
||||
pkg_names_without_deps = [
|
||||
name for name in to_be_ordered if not packages[name]]
|
||||
if not pkg_names_without_deps:
|
||||
reduce_cycle_set(packages)
|
||||
raise RuntimeError(
|
||||
'Circular dependency between: ' + ', '.join(sorted(packages)))
|
||||
pkg_names_without_deps.sort()
|
||||
pkg_name = pkg_names_without_deps[0]
|
||||
to_be_ordered.remove(pkg_name)
|
||||
ordered.append(pkg_name)
|
||||
# remove item from dependency lists
|
||||
for k in list(packages.keys()):
|
||||
if pkg_name in packages[k]:
|
||||
packages[k].remove(pkg_name)
|
||||
return ordered
|
||||
|
||||
|
||||
def reduce_cycle_set(packages):
|
||||
"""
|
||||
Reduce the set of packages to the ones part of the circular dependency.
|
||||
|
||||
:param dict packages: A mapping from package name to the set of runtime
|
||||
dependencies which is modified in place
|
||||
"""
|
||||
last_depended = None
|
||||
while len(packages) > 0:
|
||||
# get all remaining dependencies
|
||||
depended = set()
|
||||
for pkg_name, dependencies in packages.items():
|
||||
depended = depended.union(dependencies)
|
||||
# remove all packages which are not dependent on
|
||||
for name in list(packages.keys()):
|
||||
if name not in depended:
|
||||
del packages[name]
|
||||
if last_depended:
|
||||
# if remaining packages haven't changed return them
|
||||
if last_depended == depended:
|
||||
return packages.keys()
|
||||
# otherwise reduce again
|
||||
last_depended = depended
|
||||
|
||||
|
||||
def _include_comments():
|
||||
# skipping comment lines when COLCON_TRACE is not set speeds up the
|
||||
# processing especially on Windows
|
||||
return bool(os.environ.get('COLCON_TRACE'))
|
||||
|
||||
|
||||
def get_commands(pkg_name, prefix, primary_extension, additional_extension):
|
||||
commands = []
|
||||
package_dsv_path = os.path.join(prefix, 'share', pkg_name, 'package.dsv')
|
||||
if os.path.exists(package_dsv_path):
|
||||
commands += process_dsv_file(
|
||||
package_dsv_path, prefix, primary_extension, additional_extension)
|
||||
return commands
|
||||
|
||||
|
||||
def process_dsv_file(
|
||||
dsv_path, prefix, primary_extension=None, additional_extension=None
|
||||
):
|
||||
commands = []
|
||||
if _include_comments():
|
||||
commands.append(FORMAT_STR_COMMENT_LINE.format_map({'comment': dsv_path}))
|
||||
with open(dsv_path, 'r') as h:
|
||||
content = h.read()
|
||||
lines = content.splitlines()
|
||||
|
||||
basenames = OrderedDict()
|
||||
for i, line in enumerate(lines):
|
||||
# skip over empty or whitespace-only lines
|
||||
if not line.strip():
|
||||
continue
|
||||
# skip over comments
|
||||
if line.startswith('#'):
|
||||
continue
|
||||
try:
|
||||
type_, remainder = line.split(';', 1)
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"Line %d in '%s' doesn't contain a semicolon separating the "
|
||||
'type from the arguments' % (i + 1, dsv_path))
|
||||
if type_ != DSV_TYPE_SOURCE:
|
||||
# handle non-source lines
|
||||
try:
|
||||
commands += handle_dsv_types_except_source(
|
||||
type_, remainder, prefix)
|
||||
except RuntimeError as e:
|
||||
raise RuntimeError(
|
||||
"Line %d in '%s' %s" % (i + 1, dsv_path, e)) from e
|
||||
else:
|
||||
# group remaining source lines by basename
|
||||
path_without_ext, ext = os.path.splitext(remainder)
|
||||
if path_without_ext not in basenames:
|
||||
basenames[path_without_ext] = set()
|
||||
assert ext.startswith('.')
|
||||
ext = ext[1:]
|
||||
if ext in (primary_extension, additional_extension):
|
||||
basenames[path_without_ext].add(ext)
|
||||
|
||||
# add the dsv extension to each basename if the file exists
|
||||
for basename, extensions in basenames.items():
|
||||
if not os.path.isabs(basename):
|
||||
basename = os.path.join(prefix, basename)
|
||||
if os.path.exists(basename + '.dsv'):
|
||||
extensions.add('dsv')
|
||||
|
||||
for basename, extensions in basenames.items():
|
||||
if not os.path.isabs(basename):
|
||||
basename = os.path.join(prefix, basename)
|
||||
if 'dsv' in extensions:
|
||||
# process dsv files recursively
|
||||
commands += process_dsv_file(
|
||||
basename + '.dsv', prefix, primary_extension=primary_extension,
|
||||
additional_extension=additional_extension)
|
||||
elif primary_extension in extensions and len(extensions) == 1:
|
||||
# source primary-only files
|
||||
commands += [
|
||||
FORMAT_STR_INVOKE_SCRIPT.format_map({
|
||||
'prefix': prefix,
|
||||
'script_path': basename + '.' + primary_extension})]
|
||||
elif additional_extension in extensions:
|
||||
# source non-primary files
|
||||
commands += [
|
||||
FORMAT_STR_INVOKE_SCRIPT.format_map({
|
||||
'prefix': prefix,
|
||||
'script_path': basename + '.' + additional_extension})]
|
||||
|
||||
return commands
|
||||
|
||||
|
||||
def handle_dsv_types_except_source(type_, remainder, prefix):
|
||||
commands = []
|
||||
if type_ in (DSV_TYPE_SET, DSV_TYPE_SET_IF_UNSET):
|
||||
try:
|
||||
env_name, value = remainder.split(';', 1)
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"doesn't contain a semicolon separating the environment name "
|
||||
'from the value')
|
||||
try_prefixed_value = os.path.join(prefix, value) if value else prefix
|
||||
if os.path.exists(try_prefixed_value):
|
||||
value = try_prefixed_value
|
||||
if type_ == DSV_TYPE_SET:
|
||||
commands += _set(env_name, value)
|
||||
elif type_ == DSV_TYPE_SET_IF_UNSET:
|
||||
commands += _set_if_unset(env_name, value)
|
||||
else:
|
||||
assert False
|
||||
elif type_ in (
|
||||
DSV_TYPE_APPEND_NON_DUPLICATE,
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE,
|
||||
DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS
|
||||
):
|
||||
try:
|
||||
env_name_and_values = remainder.split(';')
|
||||
except ValueError:
|
||||
raise RuntimeError(
|
||||
"doesn't contain a semicolon separating the environment name "
|
||||
'from the values')
|
||||
env_name = env_name_and_values[0]
|
||||
values = env_name_and_values[1:]
|
||||
for value in values:
|
||||
if not value:
|
||||
value = prefix
|
||||
elif not os.path.isabs(value):
|
||||
value = os.path.join(prefix, value)
|
||||
if (
|
||||
type_ == DSV_TYPE_PREPEND_NON_DUPLICATE_IF_EXISTS and
|
||||
not os.path.exists(value)
|
||||
):
|
||||
comment = f'skip extending {env_name} with not existing ' \
|
||||
f'path: {value}'
|
||||
if _include_comments():
|
||||
commands.append(
|
||||
FORMAT_STR_COMMENT_LINE.format_map({'comment': comment}))
|
||||
elif type_ == DSV_TYPE_APPEND_NON_DUPLICATE:
|
||||
commands += _append_unique_value(env_name, value)
|
||||
else:
|
||||
commands += _prepend_unique_value(env_name, value)
|
||||
else:
|
||||
raise RuntimeError(
|
||||
'contains an unknown environment hook type: ' + type_)
|
||||
return commands
|
||||
|
||||
|
||||
env_state = {}
|
||||
|
||||
|
||||
def _append_unique_value(name, value):
|
||||
global env_state
|
||||
if name not in env_state:
|
||||
if os.environ.get(name):
|
||||
env_state[name] = set(os.environ[name].split(os.pathsep))
|
||||
else:
|
||||
env_state[name] = set()
|
||||
# append even if the variable has not been set yet, in case a shell script sets the
|
||||
# same variable without the knowledge of this Python script.
|
||||
# later _remove_ending_separators() will cleanup any unintentional leading separator
|
||||
extend = FORMAT_STR_USE_ENV_VAR.format_map({'name': name}) + os.pathsep
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': extend + value})
|
||||
if value not in env_state[name]:
|
||||
env_state[name].add(value)
|
||||
else:
|
||||
if not _include_comments():
|
||||
return []
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
def _prepend_unique_value(name, value):
|
||||
global env_state
|
||||
if name not in env_state:
|
||||
if os.environ.get(name):
|
||||
env_state[name] = set(os.environ[name].split(os.pathsep))
|
||||
else:
|
||||
env_state[name] = set()
|
||||
# prepend even if the variable has not been set yet, in case a shell script sets the
|
||||
# same variable without the knowledge of this Python script.
|
||||
# later _remove_ending_separators() will cleanup any unintentional trailing separator
|
||||
extend = os.pathsep + FORMAT_STR_USE_ENV_VAR.format_map({'name': name})
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value + extend})
|
||||
if value not in env_state[name]:
|
||||
env_state[name].add(value)
|
||||
else:
|
||||
if not _include_comments():
|
||||
return []
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
# generate commands for removing prepended underscores
|
||||
def _remove_ending_separators():
|
||||
# do nothing if the shell extension does not implement the logic
|
||||
if FORMAT_STR_REMOVE_TRAILING_SEPARATOR is None:
|
||||
return []
|
||||
|
||||
global env_state
|
||||
commands = []
|
||||
for name in env_state:
|
||||
# skip variables that already had values before this script started prepending
|
||||
if name in os.environ:
|
||||
continue
|
||||
commands += [
|
||||
FORMAT_STR_REMOVE_LEADING_SEPARATOR.format_map({'name': name}),
|
||||
FORMAT_STR_REMOVE_TRAILING_SEPARATOR.format_map({'name': name})]
|
||||
return commands
|
||||
|
||||
|
||||
def _set(name, value):
|
||||
global env_state
|
||||
env_state[name] = value
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value})
|
||||
return [line]
|
||||
|
||||
|
||||
def _set_if_unset(name, value):
|
||||
global env_state
|
||||
line = FORMAT_STR_SET_ENV_VAR.format_map(
|
||||
{'name': name, 'value': value})
|
||||
if env_state.get(name, os.environ.get(name)):
|
||||
line = FORMAT_STR_COMMENT_LINE.format_map({'comment': line})
|
||||
return [line]
|
||||
|
||||
|
||||
if __name__ == '__main__': # pragma: no cover
|
||||
try:
|
||||
rc = main()
|
||||
except RuntimeError as e:
|
||||
print(str(e), file=sys.stderr)
|
||||
rc = 1
|
||||
sys.exit(rc)
|
||||
@@ -0,0 +1,33 @@
|
||||
#!/usr/bin/python3
|
||||
# EASY-INSTALL-ENTRY-SCRIPT: 'arduino-bridge','console_scripts','arduino_bridge'
|
||||
import re
|
||||
import sys
|
||||
|
||||
# for compatibility with easy_install; see #2198
|
||||
__requires__ = 'arduino-bridge'
|
||||
|
||||
try:
|
||||
from importlib.metadata import distribution
|
||||
except ImportError:
|
||||
try:
|
||||
from importlib_metadata import distribution
|
||||
except ImportError:
|
||||
from pkg_resources import load_entry_point
|
||||
|
||||
|
||||
def importlib_load_entry_point(spec, group, name):
|
||||
dist_name, _, _ = spec.partition('==')
|
||||
matches = (
|
||||
entry_point
|
||||
for entry_point in distribution(dist_name).entry_points
|
||||
if entry_point.group == group and entry_point.name == name
|
||||
)
|
||||
return next(matches).load()
|
||||
|
||||
|
||||
globals().setdefault('load_entry_point', importlib_load_entry_point)
|
||||
|
||||
|
||||
if __name__ == '__main__':
|
||||
sys.argv[0] = re.sub(r'(-script\.pyw?|\.exe)?$', '', sys.argv[0])
|
||||
sys.exit(load_entry_point('arduino-bridge', 'console_scripts', 'arduino_bridge')())
|
||||
@@ -0,0 +1,2 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
.
|
||||
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/resource/arduino_bridge
|
||||
@@ -0,0 +1 @@
|
||||
prepend-non-duplicate;AMENT_PREFIX_PATH;
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_powershell/shell/template/hook_prepend_value.ps1.em
|
||||
|
||||
colcon_prepend_unique_value AMENT_PREFIX_PATH "$env:COLCON_CURRENT_PREFIX"
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_core/shell/template/hook_prepend_value.sh.em
|
||||
|
||||
_colcon_prepend_unique_value AMENT_PREFIX_PATH "$COLCON_CURRENT_PREFIX"
|
||||
@@ -0,0 +1 @@
|
||||
prepend-non-duplicate;PYTHONPATH;lib/python3.10/site-packages
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_powershell/shell/template/hook_prepend_value.ps1.em
|
||||
|
||||
colcon_prepend_unique_value PYTHONPATH "$env:COLCON_CURRENT_PREFIX\lib/python3.10/site-packages"
|
||||
@@ -0,0 +1,3 @@
|
||||
# generated from colcon_core/shell/template/hook_prepend_value.sh.em
|
||||
|
||||
_colcon_prepend_unique_value PYTHONPATH "$COLCON_CURRENT_PREFIX/lib/python3.10/site-packages"
|
||||
@@ -0,0 +1,31 @@
|
||||
# generated from colcon_bash/shell/template/package.bash.em
|
||||
|
||||
# This script extends the environment for this package.
|
||||
|
||||
# a bash script is able to determine its own path if necessary
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
# the prefix is two levels up from the package specific share directory
|
||||
_colcon_package_bash_COLCON_CURRENT_PREFIX="$(builtin cd "`dirname "${BASH_SOURCE[0]}"`/../.." > /dev/null && pwd)"
|
||||
else
|
||||
_colcon_package_bash_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
# additional arguments: arguments to the script
|
||||
_colcon_package_bash_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$@"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# source sh script of this package
|
||||
_colcon_package_bash_source_script "$_colcon_package_bash_COLCON_CURRENT_PREFIX/share/arduino_bridge/package.sh"
|
||||
|
||||
unset _colcon_package_bash_source_script
|
||||
unset _colcon_package_bash_COLCON_CURRENT_PREFIX
|
||||
@@ -0,0 +1,9 @@
|
||||
source;share/arduino_bridge/hook/pythonpath.ps1
|
||||
source;share/arduino_bridge/hook/pythonpath.dsv
|
||||
source;share/arduino_bridge/hook/pythonpath.sh
|
||||
source;share/arduino_bridge/hook/ament_prefix_path.ps1
|
||||
source;share/arduino_bridge/hook/ament_prefix_path.dsv
|
||||
source;share/arduino_bridge/hook/ament_prefix_path.sh
|
||||
source;../../build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.ps1
|
||||
source;../../build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.dsv
|
||||
source;../../build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.sh
|
||||
@@ -0,0 +1,117 @@
|
||||
# generated from colcon_powershell/shell/template/package.ps1.em
|
||||
|
||||
# function to append a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as leading separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
function colcon_append_unique_value {
|
||||
param (
|
||||
$_listname,
|
||||
$_value
|
||||
)
|
||||
|
||||
# get values from variable
|
||||
if (Test-Path Env:$_listname) {
|
||||
$_values=(Get-Item env:$_listname).Value
|
||||
} else {
|
||||
$_values=""
|
||||
}
|
||||
$_duplicate=""
|
||||
# start with no values
|
||||
$_all_values=""
|
||||
# iterate over existing values in the variable
|
||||
if ($_values) {
|
||||
$_values.Split(";") | ForEach {
|
||||
# not an empty string
|
||||
if ($_) {
|
||||
# not a duplicate of _value
|
||||
if ($_ -eq $_value) {
|
||||
$_duplicate="1"
|
||||
}
|
||||
if ($_all_values) {
|
||||
$_all_values="${_all_values};$_"
|
||||
} else {
|
||||
$_all_values="$_"
|
||||
}
|
||||
}
|
||||
}
|
||||
}
|
||||
# append only non-duplicates
|
||||
if (!$_duplicate) {
|
||||
# avoid leading separator
|
||||
if ($_all_values) {
|
||||
$_all_values="${_all_values};${_value}"
|
||||
} else {
|
||||
$_all_values="${_value}"
|
||||
}
|
||||
}
|
||||
|
||||
# export the updated variable
|
||||
Set-Item env:\$_listname -Value "$_all_values"
|
||||
}
|
||||
|
||||
# function to prepend a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as trailing separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
function colcon_prepend_unique_value {
|
||||
param (
|
||||
$_listname,
|
||||
$_value
|
||||
)
|
||||
|
||||
# get values from variable
|
||||
if (Test-Path Env:$_listname) {
|
||||
$_values=(Get-Item env:$_listname).Value
|
||||
} else {
|
||||
$_values=""
|
||||
}
|
||||
# start with the new value
|
||||
$_all_values="$_value"
|
||||
# iterate over existing values in the variable
|
||||
if ($_values) {
|
||||
$_values.Split(";") | ForEach {
|
||||
# not an empty string
|
||||
if ($_) {
|
||||
# not a duplicate of _value
|
||||
if ($_ -ne $_value) {
|
||||
# keep non-duplicate values
|
||||
$_all_values="${_all_values};$_"
|
||||
}
|
||||
}
|
||||
}
|
||||
}
|
||||
# export the updated variable
|
||||
Set-Item env:\$_listname -Value "$_all_values"
|
||||
}
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
# additional arguments: arguments to the script
|
||||
function colcon_package_source_powershell_script {
|
||||
param (
|
||||
$_colcon_package_source_powershell_script
|
||||
)
|
||||
# source script with conditional trace output
|
||||
if (Test-Path $_colcon_package_source_powershell_script) {
|
||||
if ($env:COLCON_TRACE) {
|
||||
echo ". '$_colcon_package_source_powershell_script'"
|
||||
}
|
||||
. "$_colcon_package_source_powershell_script"
|
||||
} else {
|
||||
Write-Error "not found: '$_colcon_package_source_powershell_script'"
|
||||
}
|
||||
}
|
||||
|
||||
|
||||
# a powershell script is able to determine its own path
|
||||
# the prefix is two levels up from the package specific share directory
|
||||
$env:COLCON_CURRENT_PREFIX=(Get-Item $PSCommandPath).Directory.Parent.Parent.FullName
|
||||
|
||||
colcon_package_source_powershell_script "$env:COLCON_CURRENT_PREFIX\share/arduino_bridge/hook/pythonpath.ps1"
|
||||
colcon_package_source_powershell_script "$env:COLCON_CURRENT_PREFIX\share/arduino_bridge/hook/ament_prefix_path.ps1"
|
||||
colcon_package_source_powershell_script "$env:COLCON_CURRENT_PREFIX\../../build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.ps1"
|
||||
|
||||
Remove-Item Env:\COLCON_CURRENT_PREFIX
|
||||
@@ -0,0 +1,88 @@
|
||||
# generated from colcon_core/shell/template/package.sh.em
|
||||
|
||||
# This script extends the environment for this package.
|
||||
|
||||
# function to prepend a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as trailing separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
_colcon_prepend_unique_value() {
|
||||
# arguments
|
||||
_listname="$1"
|
||||
_value="$2"
|
||||
|
||||
# get values from variable
|
||||
eval _values=\"\$$_listname\"
|
||||
# backup the field separator
|
||||
_colcon_prepend_unique_value_IFS=$IFS
|
||||
IFS=":"
|
||||
# start with the new value
|
||||
_all_values="$_value"
|
||||
# workaround SH_WORD_SPLIT not being set in zsh
|
||||
if [ "$(command -v colcon_zsh_convert_to_array)" ]; then
|
||||
colcon_zsh_convert_to_array _values
|
||||
fi
|
||||
# iterate over existing values in the variable
|
||||
for _item in $_values; do
|
||||
# ignore empty strings
|
||||
if [ -z "$_item" ]; then
|
||||
continue
|
||||
fi
|
||||
# ignore duplicates of _value
|
||||
if [ "$_item" = "$_value" ]; then
|
||||
continue
|
||||
fi
|
||||
# keep non-duplicate values
|
||||
_all_values="$_all_values:$_item"
|
||||
done
|
||||
unset _item
|
||||
# restore the field separator
|
||||
IFS=$_colcon_prepend_unique_value_IFS
|
||||
unset _colcon_prepend_unique_value_IFS
|
||||
# export the updated variable
|
||||
eval export $_listname=\"$_all_values\"
|
||||
unset _all_values
|
||||
unset _values
|
||||
|
||||
unset _value
|
||||
unset _listname
|
||||
}
|
||||
|
||||
# since a plain shell script can't determine its own path when being sourced
|
||||
# either use the provided COLCON_CURRENT_PREFIX
|
||||
# or fall back to the build time prefix (if it exists)
|
||||
_colcon_package_sh_COLCON_CURRENT_PREFIX="/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge"
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
if [ ! -d "$_colcon_package_sh_COLCON_CURRENT_PREFIX" ]; then
|
||||
echo "The build time path \"$_colcon_package_sh_COLCON_CURRENT_PREFIX\" doesn't exist. Either source a script for a different shell or set the environment variable \"COLCON_CURRENT_PREFIX\" explicitly." 1>&2
|
||||
unset _colcon_package_sh_COLCON_CURRENT_PREFIX
|
||||
return 1
|
||||
fi
|
||||
COLCON_CURRENT_PREFIX="$_colcon_package_sh_COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
unset _colcon_package_sh_COLCON_CURRENT_PREFIX
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
# additional arguments: arguments to the script
|
||||
_colcon_package_sh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$@"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# source sh hooks
|
||||
_colcon_package_sh_source_script "$COLCON_CURRENT_PREFIX/share/arduino_bridge/hook/pythonpath.sh"
|
||||
_colcon_package_sh_source_script "$COLCON_CURRENT_PREFIX/share/arduino_bridge/hook/ament_prefix_path.sh"
|
||||
_colcon_package_sh_source_script "$COLCON_CURRENT_PREFIX/../../build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.sh"
|
||||
|
||||
unset _colcon_package_sh_source_script
|
||||
unset COLCON_CURRENT_PREFIX
|
||||
|
||||
# do not unset _colcon_prepend_unique_value since it might be used by non-primary shell hooks
|
||||
@@ -0,0 +1 @@
|
||||
/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/package.xml
|
||||
@@ -0,0 +1,42 @@
|
||||
# generated from colcon_zsh/shell/template/package.zsh.em
|
||||
|
||||
# This script extends the environment for this package.
|
||||
|
||||
# a zsh script is able to determine its own path if necessary
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
# the prefix is two levels up from the package specific share directory
|
||||
_colcon_package_zsh_COLCON_CURRENT_PREFIX="$(builtin cd -q "`dirname "${(%):-%N}"`/../.." > /dev/null && pwd)"
|
||||
else
|
||||
_colcon_package_zsh_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
# additional arguments: arguments to the script
|
||||
_colcon_package_zsh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$@"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# function to convert array-like strings into arrays
|
||||
# to workaround SH_WORD_SPLIT not being set
|
||||
colcon_zsh_convert_to_array() {
|
||||
local _listname=$1
|
||||
local _dollar="$"
|
||||
local _split="{="
|
||||
local _to_array="(\"$_dollar$_split$_listname}\")"
|
||||
eval $_listname=$_to_array
|
||||
}
|
||||
|
||||
# source sh script of this package
|
||||
_colcon_package_zsh_source_script "$_colcon_package_zsh_COLCON_CURRENT_PREFIX/share/arduino_bridge/package.sh"
|
||||
unset convert_zsh_to_array
|
||||
|
||||
unset _colcon_package_zsh_source_script
|
||||
unset _colcon_package_zsh_COLCON_CURRENT_PREFIX
|
||||
121
ros2_ws/src/arduino_bridge/install/local_setup.bash
Normal file
121
ros2_ws/src/arduino_bridge/install/local_setup.bash
Normal file
@@ -0,0 +1,121 @@
|
||||
# generated from colcon_bash/shell/template/prefix.bash.em
|
||||
|
||||
# This script extends the environment with all packages contained in this
|
||||
# prefix path.
|
||||
|
||||
# a bash script is able to determine its own path if necessary
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
_colcon_prefix_bash_COLCON_CURRENT_PREFIX="$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)"
|
||||
else
|
||||
_colcon_prefix_bash_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
|
||||
# function to prepend a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as trailing separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
_colcon_prefix_bash_prepend_unique_value() {
|
||||
# arguments
|
||||
_listname="$1"
|
||||
_value="$2"
|
||||
|
||||
# get values from variable
|
||||
eval _values=\"\$$_listname\"
|
||||
# backup the field separator
|
||||
_colcon_prefix_bash_prepend_unique_value_IFS="$IFS"
|
||||
IFS=":"
|
||||
# start with the new value
|
||||
_all_values="$_value"
|
||||
_contained_value=""
|
||||
# iterate over existing values in the variable
|
||||
for _item in $_values; do
|
||||
# ignore empty strings
|
||||
if [ -z "$_item" ]; then
|
||||
continue
|
||||
fi
|
||||
# ignore duplicates of _value
|
||||
if [ "$_item" = "$_value" ]; then
|
||||
_contained_value=1
|
||||
continue
|
||||
fi
|
||||
# keep non-duplicate values
|
||||
_all_values="$_all_values:$_item"
|
||||
done
|
||||
unset _item
|
||||
if [ -z "$_contained_value" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
if [ "$_all_values" = "$_value" ]; then
|
||||
echo "export $_listname=$_value"
|
||||
else
|
||||
echo "export $_listname=$_value:\$$_listname"
|
||||
fi
|
||||
fi
|
||||
fi
|
||||
unset _contained_value
|
||||
# restore the field separator
|
||||
IFS="$_colcon_prefix_bash_prepend_unique_value_IFS"
|
||||
unset _colcon_prefix_bash_prepend_unique_value_IFS
|
||||
# export the updated variable
|
||||
eval export $_listname=\"$_all_values\"
|
||||
unset _all_values
|
||||
unset _values
|
||||
|
||||
unset _value
|
||||
unset _listname
|
||||
}
|
||||
|
||||
# add this prefix to the COLCON_PREFIX_PATH
|
||||
_colcon_prefix_bash_prepend_unique_value COLCON_PREFIX_PATH "$_colcon_prefix_bash_COLCON_CURRENT_PREFIX"
|
||||
unset _colcon_prefix_bash_prepend_unique_value
|
||||
|
||||
# check environment variable for custom Python executable
|
||||
if [ -n "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
if [ ! -f "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
echo "error: COLCON_PYTHON_EXECUTABLE '$COLCON_PYTHON_EXECUTABLE' doesn't exist"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable="$COLCON_PYTHON_EXECUTABLE"
|
||||
else
|
||||
# try the Python executable known at configure time
|
||||
_colcon_python_executable="/usr/bin/python3"
|
||||
# if it doesn't exist try a fall back
|
||||
if [ ! -f "$_colcon_python_executable" ]; then
|
||||
if ! /usr/bin/env python3 --version > /dev/null 2> /dev/null; then
|
||||
echo "error: unable to find python3 executable"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable=`/usr/bin/env python3 -c "import sys; print(sys.executable)"`
|
||||
fi
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_sh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# get all commands in topological order
|
||||
_colcon_ordered_commands="$($_colcon_python_executable "$_colcon_prefix_bash_COLCON_CURRENT_PREFIX/_local_setup_util_sh.py" sh bash)"
|
||||
unset _colcon_python_executable
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "$(declare -f _colcon_prefix_sh_source_script)"
|
||||
echo "# Execute generated script:"
|
||||
echo "# <<<"
|
||||
echo "${_colcon_ordered_commands}"
|
||||
echo "# >>>"
|
||||
echo "unset _colcon_prefix_sh_source_script"
|
||||
fi
|
||||
eval "${_colcon_ordered_commands}"
|
||||
unset _colcon_ordered_commands
|
||||
|
||||
unset _colcon_prefix_sh_source_script
|
||||
|
||||
unset _colcon_prefix_bash_COLCON_CURRENT_PREFIX
|
||||
55
ros2_ws/src/arduino_bridge/install/local_setup.ps1
Normal file
55
ros2_ws/src/arduino_bridge/install/local_setup.ps1
Normal file
@@ -0,0 +1,55 @@
|
||||
# generated from colcon_powershell/shell/template/prefix.ps1.em
|
||||
|
||||
# This script extends the environment with all packages contained in this
|
||||
# prefix path.
|
||||
|
||||
# check environment variable for custom Python executable
|
||||
if ($env:COLCON_PYTHON_EXECUTABLE) {
|
||||
if (!(Test-Path "$env:COLCON_PYTHON_EXECUTABLE" -PathType Leaf)) {
|
||||
echo "error: COLCON_PYTHON_EXECUTABLE '$env:COLCON_PYTHON_EXECUTABLE' doesn't exist"
|
||||
exit 1
|
||||
}
|
||||
$_colcon_python_executable="$env:COLCON_PYTHON_EXECUTABLE"
|
||||
} else {
|
||||
# use the Python executable known at configure time
|
||||
$_colcon_python_executable="/usr/bin/python3"
|
||||
# if it doesn't exist try a fall back
|
||||
if (!(Test-Path "$_colcon_python_executable" -PathType Leaf)) {
|
||||
if (!(Get-Command "python3" -ErrorAction SilentlyContinue)) {
|
||||
echo "error: unable to find python3 executable"
|
||||
exit 1
|
||||
}
|
||||
$_colcon_python_executable="python3"
|
||||
}
|
||||
}
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
function _colcon_prefix_powershell_source_script {
|
||||
param (
|
||||
$_colcon_prefix_powershell_source_script_param
|
||||
)
|
||||
# source script with conditional trace output
|
||||
if (Test-Path $_colcon_prefix_powershell_source_script_param) {
|
||||
if ($env:COLCON_TRACE) {
|
||||
echo ". '$_colcon_prefix_powershell_source_script_param'"
|
||||
}
|
||||
. "$_colcon_prefix_powershell_source_script_param"
|
||||
} else {
|
||||
Write-Error "not found: '$_colcon_prefix_powershell_source_script_param'"
|
||||
}
|
||||
}
|
||||
|
||||
# get all commands in topological order
|
||||
$_colcon_ordered_commands = & "$_colcon_python_executable" "$(Split-Path $PSCommandPath -Parent)/_local_setup_util_ps1.py" ps1
|
||||
|
||||
# execute all commands in topological order
|
||||
if ($env:COLCON_TRACE) {
|
||||
echo "Execute generated script:"
|
||||
echo "<<<"
|
||||
$_colcon_ordered_commands.Split([Environment]::NewLine, [StringSplitOptions]::RemoveEmptyEntries) | Write-Output
|
||||
echo ">>>"
|
||||
}
|
||||
if ($_colcon_ordered_commands) {
|
||||
$_colcon_ordered_commands.Split([Environment]::NewLine, [StringSplitOptions]::RemoveEmptyEntries) | Invoke-Expression
|
||||
}
|
||||
137
ros2_ws/src/arduino_bridge/install/local_setup.sh
Normal file
137
ros2_ws/src/arduino_bridge/install/local_setup.sh
Normal file
@@ -0,0 +1,137 @@
|
||||
# generated from colcon_core/shell/template/prefix.sh.em
|
||||
|
||||
# This script extends the environment with all packages contained in this
|
||||
# prefix path.
|
||||
|
||||
# since a plain shell script can't determine its own path when being sourced
|
||||
# either use the provided COLCON_CURRENT_PREFIX
|
||||
# or fall back to the build time prefix (if it exists)
|
||||
_colcon_prefix_sh_COLCON_CURRENT_PREFIX="/home/koray/ros2_ws/arduino_bridge/install"
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
if [ ! -d "$_colcon_prefix_sh_COLCON_CURRENT_PREFIX" ]; then
|
||||
echo "The build time path \"$_colcon_prefix_sh_COLCON_CURRENT_PREFIX\" doesn't exist. Either source a script for a different shell or set the environment variable \"COLCON_CURRENT_PREFIX\" explicitly." 1>&2
|
||||
unset _colcon_prefix_sh_COLCON_CURRENT_PREFIX
|
||||
return 1
|
||||
fi
|
||||
else
|
||||
_colcon_prefix_sh_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
|
||||
# function to prepend a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as trailing separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
_colcon_prefix_sh_prepend_unique_value() {
|
||||
# arguments
|
||||
_listname="$1"
|
||||
_value="$2"
|
||||
|
||||
# get values from variable
|
||||
eval _values=\"\$$_listname\"
|
||||
# backup the field separator
|
||||
_colcon_prefix_sh_prepend_unique_value_IFS="$IFS"
|
||||
IFS=":"
|
||||
# start with the new value
|
||||
_all_values="$_value"
|
||||
_contained_value=""
|
||||
# iterate over existing values in the variable
|
||||
for _item in $_values; do
|
||||
# ignore empty strings
|
||||
if [ -z "$_item" ]; then
|
||||
continue
|
||||
fi
|
||||
# ignore duplicates of _value
|
||||
if [ "$_item" = "$_value" ]; then
|
||||
_contained_value=1
|
||||
continue
|
||||
fi
|
||||
# keep non-duplicate values
|
||||
_all_values="$_all_values:$_item"
|
||||
done
|
||||
unset _item
|
||||
if [ -z "$_contained_value" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
if [ "$_all_values" = "$_value" ]; then
|
||||
echo "export $_listname=$_value"
|
||||
else
|
||||
echo "export $_listname=$_value:\$$_listname"
|
||||
fi
|
||||
fi
|
||||
fi
|
||||
unset _contained_value
|
||||
# restore the field separator
|
||||
IFS="$_colcon_prefix_sh_prepend_unique_value_IFS"
|
||||
unset _colcon_prefix_sh_prepend_unique_value_IFS
|
||||
# export the updated variable
|
||||
eval export $_listname=\"$_all_values\"
|
||||
unset _all_values
|
||||
unset _values
|
||||
|
||||
unset _value
|
||||
unset _listname
|
||||
}
|
||||
|
||||
# add this prefix to the COLCON_PREFIX_PATH
|
||||
_colcon_prefix_sh_prepend_unique_value COLCON_PREFIX_PATH "$_colcon_prefix_sh_COLCON_CURRENT_PREFIX"
|
||||
unset _colcon_prefix_sh_prepend_unique_value
|
||||
|
||||
# check environment variable for custom Python executable
|
||||
if [ -n "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
if [ ! -f "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
echo "error: COLCON_PYTHON_EXECUTABLE '$COLCON_PYTHON_EXECUTABLE' doesn't exist"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable="$COLCON_PYTHON_EXECUTABLE"
|
||||
else
|
||||
# try the Python executable known at configure time
|
||||
_colcon_python_executable="/usr/bin/python3"
|
||||
# if it doesn't exist try a fall back
|
||||
if [ ! -f "$_colcon_python_executable" ]; then
|
||||
if ! /usr/bin/env python3 --version > /dev/null 2> /dev/null; then
|
||||
echo "error: unable to find python3 executable"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable=`/usr/bin/env python3 -c "import sys; print(sys.executable)"`
|
||||
fi
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_sh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# get all commands in topological order
|
||||
_colcon_ordered_commands="$($_colcon_python_executable "$_colcon_prefix_sh_COLCON_CURRENT_PREFIX/_local_setup_util_sh.py" sh)"
|
||||
unset _colcon_python_executable
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "_colcon_prefix_sh_source_script() {
|
||||
if [ -f \"\$1\" ]; then
|
||||
if [ -n \"\$COLCON_TRACE\" ]; then
|
||||
echo \"# . \\\"\$1\\\"\"
|
||||
fi
|
||||
. \"\$1\"
|
||||
else
|
||||
echo \"not found: \\\"\$1\\\"\" 1>&2
|
||||
fi
|
||||
}"
|
||||
echo "# Execute generated script:"
|
||||
echo "# <<<"
|
||||
echo "${_colcon_ordered_commands}"
|
||||
echo "# >>>"
|
||||
echo "unset _colcon_prefix_sh_source_script"
|
||||
fi
|
||||
eval "${_colcon_ordered_commands}"
|
||||
unset _colcon_ordered_commands
|
||||
|
||||
unset _colcon_prefix_sh_source_script
|
||||
|
||||
unset _colcon_prefix_sh_COLCON_CURRENT_PREFIX
|
||||
134
ros2_ws/src/arduino_bridge/install/local_setup.zsh
Normal file
134
ros2_ws/src/arduino_bridge/install/local_setup.zsh
Normal file
@@ -0,0 +1,134 @@
|
||||
# generated from colcon_zsh/shell/template/prefix.zsh.em
|
||||
|
||||
# This script extends the environment with all packages contained in this
|
||||
# prefix path.
|
||||
|
||||
# a zsh script is able to determine its own path if necessary
|
||||
if [ -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
_colcon_prefix_zsh_COLCON_CURRENT_PREFIX="$(builtin cd -q "`dirname "${(%):-%N}"`" > /dev/null && pwd)"
|
||||
else
|
||||
_colcon_prefix_zsh_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
fi
|
||||
|
||||
# function to convert array-like strings into arrays
|
||||
# to workaround SH_WORD_SPLIT not being set
|
||||
_colcon_prefix_zsh_convert_to_array() {
|
||||
local _listname=$1
|
||||
local _dollar="$"
|
||||
local _split="{="
|
||||
local _to_array="(\"$_dollar$_split$_listname}\")"
|
||||
eval $_listname=$_to_array
|
||||
}
|
||||
|
||||
# function to prepend a value to a variable
|
||||
# which uses colons as separators
|
||||
# duplicates as well as trailing separators are avoided
|
||||
# first argument: the name of the result variable
|
||||
# second argument: the value to be prepended
|
||||
_colcon_prefix_zsh_prepend_unique_value() {
|
||||
# arguments
|
||||
_listname="$1"
|
||||
_value="$2"
|
||||
|
||||
# get values from variable
|
||||
eval _values=\"\$$_listname\"
|
||||
# backup the field separator
|
||||
_colcon_prefix_zsh_prepend_unique_value_IFS="$IFS"
|
||||
IFS=":"
|
||||
# start with the new value
|
||||
_all_values="$_value"
|
||||
_contained_value=""
|
||||
# workaround SH_WORD_SPLIT not being set
|
||||
_colcon_prefix_zsh_convert_to_array _values
|
||||
# iterate over existing values in the variable
|
||||
for _item in $_values; do
|
||||
# ignore empty strings
|
||||
if [ -z "$_item" ]; then
|
||||
continue
|
||||
fi
|
||||
# ignore duplicates of _value
|
||||
if [ "$_item" = "$_value" ]; then
|
||||
_contained_value=1
|
||||
continue
|
||||
fi
|
||||
# keep non-duplicate values
|
||||
_all_values="$_all_values:$_item"
|
||||
done
|
||||
unset _item
|
||||
if [ -z "$_contained_value" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
if [ "$_all_values" = "$_value" ]; then
|
||||
echo "export $_listname=$_value"
|
||||
else
|
||||
echo "export $_listname=$_value:\$$_listname"
|
||||
fi
|
||||
fi
|
||||
fi
|
||||
unset _contained_value
|
||||
# restore the field separator
|
||||
IFS="$_colcon_prefix_zsh_prepend_unique_value_IFS"
|
||||
unset _colcon_prefix_zsh_prepend_unique_value_IFS
|
||||
# export the updated variable
|
||||
eval export $_listname=\"$_all_values\"
|
||||
unset _all_values
|
||||
unset _values
|
||||
|
||||
unset _value
|
||||
unset _listname
|
||||
}
|
||||
|
||||
# add this prefix to the COLCON_PREFIX_PATH
|
||||
_colcon_prefix_zsh_prepend_unique_value COLCON_PREFIX_PATH "$_colcon_prefix_zsh_COLCON_CURRENT_PREFIX"
|
||||
unset _colcon_prefix_zsh_prepend_unique_value
|
||||
unset _colcon_prefix_zsh_convert_to_array
|
||||
|
||||
# check environment variable for custom Python executable
|
||||
if [ -n "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
if [ ! -f "$COLCON_PYTHON_EXECUTABLE" ]; then
|
||||
echo "error: COLCON_PYTHON_EXECUTABLE '$COLCON_PYTHON_EXECUTABLE' doesn't exist"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable="$COLCON_PYTHON_EXECUTABLE"
|
||||
else
|
||||
# try the Python executable known at configure time
|
||||
_colcon_python_executable="/usr/bin/python3"
|
||||
# if it doesn't exist try a fall back
|
||||
if [ ! -f "$_colcon_python_executable" ]; then
|
||||
if ! /usr/bin/env python3 --version > /dev/null 2> /dev/null; then
|
||||
echo "error: unable to find python3 executable"
|
||||
return 1
|
||||
fi
|
||||
_colcon_python_executable=`/usr/bin/env python3 -c "import sys; print(sys.executable)"`
|
||||
fi
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_sh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# get all commands in topological order
|
||||
_colcon_ordered_commands="$($_colcon_python_executable "$_colcon_prefix_zsh_COLCON_CURRENT_PREFIX/_local_setup_util_sh.py" sh zsh)"
|
||||
unset _colcon_python_executable
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "$(declare -f _colcon_prefix_sh_source_script)"
|
||||
echo "# Execute generated script:"
|
||||
echo "# <<<"
|
||||
echo "${_colcon_ordered_commands}"
|
||||
echo "# >>>"
|
||||
echo "unset _colcon_prefix_sh_source_script"
|
||||
fi
|
||||
eval "${_colcon_ordered_commands}"
|
||||
unset _colcon_ordered_commands
|
||||
|
||||
unset _colcon_prefix_sh_source_script
|
||||
|
||||
unset _colcon_prefix_zsh_COLCON_CURRENT_PREFIX
|
||||
31
ros2_ws/src/arduino_bridge/install/setup.bash
Normal file
31
ros2_ws/src/arduino_bridge/install/setup.bash
Normal file
@@ -0,0 +1,31 @@
|
||||
# generated from colcon_bash/shell/template/prefix_chain.bash.em
|
||||
|
||||
# This script extends the environment with the environment of other prefix
|
||||
# paths which were sourced when this file was generated as well as all packages
|
||||
# contained in this prefix path.
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_chain_bash_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# source chained prefixes
|
||||
# setting COLCON_CURRENT_PREFIX avoids determining the prefix in the sourced script
|
||||
COLCON_CURRENT_PREFIX="/opt/ros/humble"
|
||||
_colcon_prefix_chain_bash_source_script "$COLCON_CURRENT_PREFIX/local_setup.bash"
|
||||
|
||||
# source this prefix
|
||||
# setting COLCON_CURRENT_PREFIX avoids determining the prefix in the sourced script
|
||||
COLCON_CURRENT_PREFIX="$(builtin cd "`dirname "${BASH_SOURCE[0]}"`" > /dev/null && pwd)"
|
||||
_colcon_prefix_chain_bash_source_script "$COLCON_CURRENT_PREFIX/local_setup.bash"
|
||||
|
||||
unset COLCON_CURRENT_PREFIX
|
||||
unset _colcon_prefix_chain_bash_source_script
|
||||
29
ros2_ws/src/arduino_bridge/install/setup.ps1
Normal file
29
ros2_ws/src/arduino_bridge/install/setup.ps1
Normal file
@@ -0,0 +1,29 @@
|
||||
# generated from colcon_powershell/shell/template/prefix_chain.ps1.em
|
||||
|
||||
# This script extends the environment with the environment of other prefix
|
||||
# paths which were sourced when this file was generated as well as all packages
|
||||
# contained in this prefix path.
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
function _colcon_prefix_chain_powershell_source_script {
|
||||
param (
|
||||
$_colcon_prefix_chain_powershell_source_script_param
|
||||
)
|
||||
# source script with conditional trace output
|
||||
if (Test-Path $_colcon_prefix_chain_powershell_source_script_param) {
|
||||
if ($env:COLCON_TRACE) {
|
||||
echo ". '$_colcon_prefix_chain_powershell_source_script_param'"
|
||||
}
|
||||
. "$_colcon_prefix_chain_powershell_source_script_param"
|
||||
} else {
|
||||
Write-Error "not found: '$_colcon_prefix_chain_powershell_source_script_param'"
|
||||
}
|
||||
}
|
||||
|
||||
# source chained prefixes
|
||||
_colcon_prefix_chain_powershell_source_script "/opt/ros/humble\local_setup.ps1"
|
||||
|
||||
# source this prefix
|
||||
$env:COLCON_CURRENT_PREFIX=(Split-Path $PSCommandPath -Parent)
|
||||
_colcon_prefix_chain_powershell_source_script "$env:COLCON_CURRENT_PREFIX\local_setup.ps1"
|
||||
45
ros2_ws/src/arduino_bridge/install/setup.sh
Normal file
45
ros2_ws/src/arduino_bridge/install/setup.sh
Normal file
@@ -0,0 +1,45 @@
|
||||
# generated from colcon_core/shell/template/prefix_chain.sh.em
|
||||
|
||||
# This script extends the environment with the environment of other prefix
|
||||
# paths which were sourced when this file was generated as well as all packages
|
||||
# contained in this prefix path.
|
||||
|
||||
# since a plain shell script can't determine its own path when being sourced
|
||||
# either use the provided COLCON_CURRENT_PREFIX
|
||||
# or fall back to the build time prefix (if it exists)
|
||||
_colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX=/home/koray/ros2_ws/arduino_bridge/install
|
||||
if [ ! -z "$COLCON_CURRENT_PREFIX" ]; then
|
||||
_colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX="$COLCON_CURRENT_PREFIX"
|
||||
elif [ ! -d "$_colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX" ]; then
|
||||
echo "The build time path \"$_colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX\" doesn't exist. Either source a script for a different shell or set the environment variable \"COLCON_CURRENT_PREFIX\" explicitly." 1>&2
|
||||
unset _colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX
|
||||
return 1
|
||||
fi
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_chain_sh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# source chained prefixes
|
||||
# setting COLCON_CURRENT_PREFIX avoids relying on the build time prefix of the sourced script
|
||||
COLCON_CURRENT_PREFIX="/opt/ros/humble"
|
||||
_colcon_prefix_chain_sh_source_script "$COLCON_CURRENT_PREFIX/local_setup.sh"
|
||||
|
||||
|
||||
# source this prefix
|
||||
# setting COLCON_CURRENT_PREFIX avoids relying on the build time prefix of the sourced script
|
||||
COLCON_CURRENT_PREFIX="$_colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX"
|
||||
_colcon_prefix_chain_sh_source_script "$COLCON_CURRENT_PREFIX/local_setup.sh"
|
||||
|
||||
unset _colcon_prefix_chain_sh_COLCON_CURRENT_PREFIX
|
||||
unset _colcon_prefix_chain_sh_source_script
|
||||
unset COLCON_CURRENT_PREFIX
|
||||
31
ros2_ws/src/arduino_bridge/install/setup.zsh
Normal file
31
ros2_ws/src/arduino_bridge/install/setup.zsh
Normal file
@@ -0,0 +1,31 @@
|
||||
# generated from colcon_zsh/shell/template/prefix_chain.zsh.em
|
||||
|
||||
# This script extends the environment with the environment of other prefix
|
||||
# paths which were sourced when this file was generated as well as all packages
|
||||
# contained in this prefix path.
|
||||
|
||||
# function to source another script with conditional trace output
|
||||
# first argument: the path of the script
|
||||
_colcon_prefix_chain_zsh_source_script() {
|
||||
if [ -f "$1" ]; then
|
||||
if [ -n "$COLCON_TRACE" ]; then
|
||||
echo "# . \"$1\""
|
||||
fi
|
||||
. "$1"
|
||||
else
|
||||
echo "not found: \"$1\"" 1>&2
|
||||
fi
|
||||
}
|
||||
|
||||
# source chained prefixes
|
||||
# setting COLCON_CURRENT_PREFIX avoids determining the prefix in the sourced script
|
||||
COLCON_CURRENT_PREFIX="/opt/ros/humble"
|
||||
_colcon_prefix_chain_zsh_source_script "$COLCON_CURRENT_PREFIX/local_setup.zsh"
|
||||
|
||||
# source this prefix
|
||||
# setting COLCON_CURRENT_PREFIX avoids determining the prefix in the sourced script
|
||||
COLCON_CURRENT_PREFIX="$(builtin cd -q "`dirname "${(%):-%N}"`" > /dev/null && pwd)"
|
||||
_colcon_prefix_chain_zsh_source_script "$COLCON_CURRENT_PREFIX/local_setup.zsh"
|
||||
|
||||
unset COLCON_CURRENT_PREFIX
|
||||
unset _colcon_prefix_chain_zsh_source_script
|
||||
0
ros2_ws/src/arduino_bridge/log/COLCON_IGNORE
Normal file
0
ros2_ws/src/arduino_bridge/log/COLCON_IGNORE
Normal file
@@ -0,0 +1,2 @@
|
||||
Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
@@ -0,0 +1,35 @@
|
||||
running egg_info
|
||||
creating build/arduino_bridge/arduino_bridge.egg-info
|
||||
writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build
|
||||
running build_py
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
copying arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
copying arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
running install
|
||||
running install_lib
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/arduino_bridge.py to arduino_bridge.cpython-310.pyc
|
||||
byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/__init__.py to __init__.cpython-310.pyc
|
||||
running install_data
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
copying resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
copying package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
running install_egg_info
|
||||
Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
running install_scripts
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
@@ -0,0 +1,35 @@
|
||||
running egg_info
|
||||
creating build/arduino_bridge/arduino_bridge.egg-info
|
||||
writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build
|
||||
running build_py
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib
|
||||
creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
copying arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
copying arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
running install
|
||||
running install_lib
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/arduino_bridge.py to arduino_bridge.cpython-310.pyc
|
||||
byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/__init__.py to __init__.cpython-310.pyc
|
||||
running install_data
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index
|
||||
creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
copying resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
copying package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
running install_egg_info
|
||||
Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
running install_scripts
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
@@ -0,0 +1,37 @@
|
||||
[0.818s] Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[1.116s] running egg_info
|
||||
[1.117s] creating build/arduino_bridge/arduino_bridge.egg-info
|
||||
[1.117s] writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
[1.117s] writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
[1.117s] writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
[1.118s] writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
[1.118s] writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
[1.118s] writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.120s] reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.121s] writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.122s] running build
|
||||
[1.122s] running build_py
|
||||
[1.122s] creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build
|
||||
[1.122s] creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib
|
||||
[1.122s] creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
[1.123s] copying arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
[1.123s] copying arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge
|
||||
[1.123s] running install
|
||||
[1.124s] running install_lib
|
||||
[1.125s] creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
[1.126s] copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
[1.126s] copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge
|
||||
[1.126s] byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/arduino_bridge.py to arduino_bridge.cpython-310.pyc
|
||||
[1.127s] byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/__init__.py to __init__.cpython-310.pyc
|
||||
[1.128s] running install_data
|
||||
[1.128s] creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index
|
||||
[1.128s] creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index
|
||||
[1.128s] creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
[1.128s] copying resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
[1.129s] copying package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
[1.129s] running install_egg_info
|
||||
[1.131s] Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
[1.133s] running install_scripts
|
||||
[1.160s] Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
[1.160s] writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
[1.193s] Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
@@ -0,0 +1,54 @@
|
||||
[0.000000] (-) TimerEvent: {}
|
||||
[0.000398] (arduino_bridge) JobQueued: {'identifier': 'arduino_bridge', 'dependencies': OrderedDict()}
|
||||
[0.000479] (arduino_bridge) JobStarted: {'identifier': 'arduino_bridge'}
|
||||
[0.099201] (-) TimerEvent: {}
|
||||
[0.199521] (-) TimerEvent: {}
|
||||
[0.299855] (-) TimerEvent: {}
|
||||
[0.400224] (-) TimerEvent: {}
|
||||
[0.500539] (-) TimerEvent: {}
|
||||
[0.600833] (-) TimerEvent: {}
|
||||
[0.701180] (-) TimerEvent: {}
|
||||
[0.801521] (-) TimerEvent: {}
|
||||
[0.817241] (arduino_bridge) Command: {'cmd': ['/usr/bin/python3', '-W', 'ignore:setup.py install is deprecated', '-W', 'ignore:easy_install command is deprecated', 'setup.py', 'egg_info', '--egg-base', 'build/arduino_bridge', 'build', '--build-base', '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build', 'install', '--record', '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log', '--single-version-externally-managed', 'install_data'], 'cwd': '/home/koray/ros2_ws/arduino_bridge', 'env': {'LESSOPEN': '| /usr/bin/lesspipe %s', 'MESA_LOADER_DRIVER_OVERRIDE': 'iris', 'HOSTNAME': 'a42ad2b3b7ad', 'SHLVL': '1', 'LD_LIBRARY_PATH': '/home/koray/ros2_ws/arduino/install/serial/lib:/home/koray/ros2_ws/arduino/install/diffdrive_arduino/lib:/opt/ros/humble/opt/rviz_ogre_vendor/lib:/opt/ros/humble/lib/x86_64-linux-gnu:/opt/ros/humble/lib', 'HOME': '/home/koray', 'CYCLONEDDS_URI': 'file:///etc/cyclonedds/config.xml', 'OLDPWD': '/home/koray/ros2_ws/arduino_bridge/arduino_bridge', 'ROS_PYTHON_VERSION': '3', 'COLCON_PREFIX_PATH': '/home/koray/ros2_ws/arduino/install', 'ROS_DISTRO': 'humble', '_': '/usr/bin/colcon', 'ROS_VERSION': '2', 'TERM': 'xterm', 'ROS_LOCALHOST_ONLY': '0', 'PATH': '/opt/ros/humble/bin:/usr/local/sbin:/usr/local/bin:/usr/sbin:/usr/bin:/sbin:/bin', 'DISPLAY': ':0', 'LANG': 'C.UTF-8', 'RMW_IMPLEMENTATION': 'rmw_cyclonedds_cpp', 'LIBVA_DRIVER_NAME': 'i965', 'LS_COLORS': 'rs=0:di=01;34:ln=01;36:mh=00:pi=40;33:so=01;35:do=01;35:bd=40;33;01:cd=40;33;01:or=40;31;01:mi=00:su=37;41:sg=30;43:ca=30;41:tw=30;42:ow=34;42:st=37;44:ex=01;32:*.tar=01;31:*.tgz=01;31:*.arc=01;31:*.arj=01;31:*.taz=01;31:*.lha=01;31:*.lz4=01;31:*.lzh=01;31:*.lzma=01;31:*.tlz=01;31:*.txz=01;31:*.tzo=01;31:*.t7z=01;31:*.zip=01;31:*.z=01;31:*.dz=01;31:*.gz=01;31:*.lrz=01;31:*.lz=01;31:*.lzo=01;31:*.xz=01;31:*.zst=01;31:*.tzst=01;31:*.bz2=01;31:*.bz=01;31:*.tbz=01;31:*.tbz2=01;31:*.tz=01;31:*.deb=01;31:*.rpm=01;31:*.jar=01;31:*.war=01;31:*.ear=01;31:*.sar=01;31:*.rar=01;31:*.alz=01;31:*.ace=01;31:*.zoo=01;31:*.cpio=01;31:*.7z=01;31:*.rz=01;31:*.cab=01;31:*.wim=01;31:*.swm=01;31:*.dwm=01;31:*.esd=01;31:*.jpg=01;35:*.jpeg=01;35:*.mjpg=01;35:*.mjpeg=01;35:*.gif=01;35:*.bmp=01;35:*.pbm=01;35:*.pgm=01;35:*.ppm=01;35:*.tga=01;35:*.xbm=01;35:*.xpm=01;35:*.tif=01;35:*.tiff=01;35:*.png=01;35:*.svg=01;35:*.svgz=01;35:*.mng=01;35:*.pcx=01;35:*.mov=01;35:*.mpg=01;35:*.mpeg=01;35:*.m2v=01;35:*.mkv=01;35:*.webm=01;35:*.webp=01;35:*.ogm=01;35:*.mp4=01;35:*.m4v=01;35:*.mp4v=01;35:*.vob=01;35:*.qt=01;35:*.nuv=01;35:*.wmv=01;35:*.asf=01;35:*.rm=01;35:*.rmvb=01;35:*.flc=01;35:*.avi=01;35:*.fli=01;35:*.flv=01;35:*.gl=01;35:*.dl=01;35:*.xcf=01;35:*.xwd=01;35:*.yuv=01;35:*.cgm=01;35:*.emf=01;35:*.ogv=01;35:*.ogx=01;35:*.aac=00;36:*.au=00;36:*.flac=00;36:*.m4a=00;36:*.mid=00;36:*.midi=00;36:*.mka=00;36:*.mp3=00;36:*.mpc=00;36:*.ogg=00;36:*.ra=00;36:*.wav=00;36:*.oga=00;36:*.opus=00;36:*.spx=00;36:*.xspf=00;36:', 'AMENT_PREFIX_PATH': '/home/koray/ros2_ws/arduino/install/serial:/home/koray/ros2_ws/arduino/install/diffdrive_arduino:/opt/ros/humble', 'DEBIAN_FRONTEND': 'noninteractive', 'SHELL': '/bin/bash', 'LESSCLOSE': '/usr/bin/lesspipe %s %s', 'PWD': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'QT_QPA_PLATFORM': 'xcb', 'LC_ALL': 'C.UTF-8', 'PYTHONPATH': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:/opt/ros/humble/lib/python3.10/site-packages:/opt/ros/humble/local/lib/python3.10/dist-packages', 'COLCON': '1', 'CMAKE_PREFIX_PATH': '/home/koray/ros2_ws/arduino/install/serial:/home/koray/ros2_ws/arduino/install/diffdrive_arduino'}, 'shell': False}
|
||||
[0.901670] (-) TimerEvent: {}
|
||||
[1.001990] (-) TimerEvent: {}
|
||||
[1.102349] (-) TimerEvent: {}
|
||||
[1.116105] (arduino_bridge) StdoutLine: {'line': b'running egg_info\n'}
|
||||
[1.116874] (arduino_bridge) StdoutLine: {'line': b'creating build/arduino_bridge/arduino_bridge.egg-info\n'}
|
||||
[1.117114] (arduino_bridge) StdoutLine: {'line': b'writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO\n'}
|
||||
[1.117462] (arduino_bridge) StdoutLine: {'line': b'writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt\n'}
|
||||
[1.117677] (arduino_bridge) StdoutLine: {'line': b'writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt\n'}
|
||||
[1.117893] (arduino_bridge) StdoutLine: {'line': b'writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt\n'}
|
||||
[1.118046] (arduino_bridge) StdoutLine: {'line': b'writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt\n'}
|
||||
[1.118234] (arduino_bridge) StdoutLine: {'line': b"writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.120775] (arduino_bridge) StdoutLine: {'line': b"reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.121741] (arduino_bridge) StdoutLine: {'line': b"writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.122068] (arduino_bridge) StdoutLine: {'line': b'running build\n'}
|
||||
[1.122250] (arduino_bridge) StdoutLine: {'line': b'running build_py\n'}
|
||||
[1.122496] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build\n'}
|
||||
[1.122647] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib\n'}
|
||||
[1.122789] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge\n'}
|
||||
[1.123003] (arduino_bridge) StdoutLine: {'line': b'copying arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge\n'}
|
||||
[1.123257] (arduino_bridge) StdoutLine: {'line': b'copying arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge\n'}
|
||||
[1.123539] (arduino_bridge) StdoutLine: {'line': b'running install\n'}
|
||||
[1.124416] (arduino_bridge) StdoutLine: {'line': b'running install_lib\n'}
|
||||
[1.125542] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge\n'}
|
||||
[1.125838] (arduino_bridge) StdoutLine: {'line': b'copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/arduino_bridge.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge\n'}
|
||||
[1.126056] (arduino_bridge) StdoutLine: {'line': b'copying /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build/lib/arduino_bridge/__init__.py -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge\n'}
|
||||
[1.126746] (arduino_bridge) StdoutLine: {'line': b'byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/arduino_bridge.py to arduino_bridge.cpython-310.pyc\n'}
|
||||
[1.127613] (arduino_bridge) StdoutLine: {'line': b'byte-compiling /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge/__init__.py to __init__.cpython-310.pyc\n'}
|
||||
[1.127888] (arduino_bridge) StdoutLine: {'line': b'running install_data\n'}
|
||||
[1.128227] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index\n'}
|
||||
[1.128449] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index\n'}
|
||||
[1.128667] (arduino_bridge) StdoutLine: {'line': b'creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages\n'}
|
||||
[1.128832] (arduino_bridge) StdoutLine: {'line': b'copying resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages\n'}
|
||||
[1.128949] (arduino_bridge) StdoutLine: {'line': b'copying package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge\n'}
|
||||
[1.129095] (arduino_bridge) StdoutLine: {'line': b'running install_egg_info\n'}
|
||||
[1.131411] (arduino_bridge) StdoutLine: {'line': b'Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info\n'}
|
||||
[1.132948] (arduino_bridge) StdoutLine: {'line': b'running install_scripts\n'}
|
||||
[1.159932] (arduino_bridge) StdoutLine: {'line': b'Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge\n'}
|
||||
[1.160440] (arduino_bridge) StdoutLine: {'line': b"writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'\n"}
|
||||
[1.193388] (arduino_bridge) CommandEnded: {'returncode': 0}
|
||||
[1.202628] (-) TimerEvent: {}
|
||||
[1.211221] (arduino_bridge) JobEnded: {'identifier': 'arduino_bridge', 'rc': 0}
|
||||
[1.212124] (-) EventReactorShutdown: {}
|
||||
@@ -0,0 +1,96 @@
|
||||
[0.208s] DEBUG:colcon:Command line arguments: ['/usr/bin/colcon', 'build', '--packages-select', 'arduino_bridge']
|
||||
[0.208s] DEBUG:colcon:Parsed command line arguments: Namespace(log_base=None, log_level=None, verb_name='build', build_base='build', install_base='install', merge_install=False, symlink_install=False, test_result_base=None, continue_on_error=False, executor='parallel', parallel_workers=4, event_handlers=None, ignore_user_meta=False, metas=['./colcon.meta'], base_paths=['.'], packages_ignore=None, packages_ignore_regex=None, paths=None, packages_up_to=None, packages_up_to_regex=None, packages_above=None, packages_above_and_dependencies=None, packages_above_depth=None, packages_select_by_dep=None, packages_skip_by_dep=None, packages_skip_up_to=None, packages_select_build_failed=False, packages_skip_build_finished=False, packages_select_test_failures=False, packages_skip_test_passed=False, packages_select=['arduino_bridge'], packages_skip=None, packages_select_regex=None, packages_skip_regex=None, packages_start=None, packages_end=None, allow_overriding=[], cmake_args=None, cmake_target=None, cmake_target_skip_unavailable=False, cmake_clean_cache=False, cmake_clean_first=False, cmake_force_configure=False, ament_cmake_args=None, catkin_cmake_args=None, catkin_skip_building_tests=False, verb_parser=<colcon_defaults.argument_parser.defaults.DefaultArgumentsDecorator object at 0x7fc01ac823e0>, verb_extension=<colcon_core.verb.build.BuildVerb object at 0x7fc01ac81d20>, main=<bound method BuildVerb.main of <colcon_core.verb.build.BuildVerb object at 0x7fc01ac81d20>>)
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) check parameters
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) check parameters
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) check parameters
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) check parameters
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) discover
|
||||
[0.534s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) discover
|
||||
[0.534s] INFO:colcon.colcon_core.package_discovery:Crawling recursively for packages in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ignore', 'ignore_ament_install']
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore'
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore_ament_install'
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_pkg']
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_pkg'
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_meta']
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_meta'
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ros']
|
||||
[0.535s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ros'
|
||||
[0.554s] DEBUG:colcon.colcon_core.package_identification:Package '.' with type 'ros.ament_python' and name 'arduino_bridge'
|
||||
[0.555s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) using defaults
|
||||
[0.555s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) discover
|
||||
[0.555s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) using defaults
|
||||
[0.555s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) discover
|
||||
[0.555s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) using defaults
|
||||
[0.594s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) check parameters
|
||||
[0.594s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) discover
|
||||
[0.596s] WARNING:colcon.colcon_core.prefix_path.colcon:The path '/home/koray/ros2_ws/arduino/install' in the environment variable COLCON_PREFIX_PATH doesn't exist
|
||||
[0.597s] WARNING:colcon.colcon_ros.prefix_path.ament:The path '/home/koray/ros2_ws/arduino/install/serial' in the environment variable AMENT_PREFIX_PATH doesn't exist
|
||||
[0.597s] WARNING:colcon.colcon_ros.prefix_path.ament:The path '/home/koray/ros2_ws/arduino/install/diffdrive_arduino' in the environment variable AMENT_PREFIX_PATH doesn't exist
|
||||
[0.597s] WARNING:colcon.colcon_ros.prefix_path.catkin:The path '/home/koray/ros2_ws/arduino/install/serial' in the environment variable CMAKE_PREFIX_PATH doesn't exist
|
||||
[0.597s] WARNING:colcon.colcon_ros.prefix_path.catkin:The path '/home/koray/ros2_ws/arduino/install/diffdrive_arduino' in the environment variable CMAKE_PREFIX_PATH doesn't exist
|
||||
[0.601s] DEBUG:colcon.colcon_installed_package_information.package_discovery:Found 288 installed packages in /opt/ros/humble
|
||||
[0.603s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) using defaults
|
||||
[0.696s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_args' from command line to 'None'
|
||||
[0.696s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target' from command line to 'None'
|
||||
[0.696s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target_skip_unavailable' from command line to 'False'
|
||||
[0.696s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_cache' from command line to 'False'
|
||||
[0.696s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_first' from command line to 'False'
|
||||
[0.697s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_force_configure' from command line to 'False'
|
||||
[0.697s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'ament_cmake_args' from command line to 'None'
|
||||
[0.697s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_cmake_args' from command line to 'None'
|
||||
[0.697s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_skip_building_tests' from command line to 'False'
|
||||
[0.697s] DEBUG:colcon.colcon_core.verb:Building package 'arduino_bridge' with the following arguments: {'ament_cmake_args': None, 'build_base': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'catkin_cmake_args': None, 'catkin_skip_building_tests': False, 'cmake_args': None, 'cmake_clean_cache': False, 'cmake_clean_first': False, 'cmake_force_configure': False, 'cmake_target': None, 'cmake_target_skip_unavailable': False, 'install_base': '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge', 'merge_install': False, 'path': '/home/koray/ros2_ws/arduino_bridge', 'symlink_install': False, 'test_result_base': None}
|
||||
[0.697s] INFO:colcon.colcon_core.executor:Executing jobs using 'parallel' executor
|
||||
[0.698s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete
|
||||
[0.698s] INFO:colcon.colcon_ros.task.ament_python.build:Building ROS package in '/home/koray/ros2_ws/arduino_bridge' with build type 'ament_python'
|
||||
[0.698s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'ament_prefix_path')
|
||||
[0.704s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_core.shell.bat': Not used on non-Windows systems
|
||||
[0.704s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.ps1'
|
||||
[0.705s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.dsv'
|
||||
[0.706s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.sh'
|
||||
[0.709s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[0.709s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[1.049s] INFO:colcon.colcon_core.task.python.build:Building Python package in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[1.049s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[1.049s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[1.517s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[1.892s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[1.897s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake module files
|
||||
[1.898s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake config files
|
||||
[1.899s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib'
|
||||
[1.899s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[1.899s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/pkgconfig/arduino_bridge.pc'
|
||||
[1.899s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages'
|
||||
[1.899s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'pythonpath')
|
||||
[1.900s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.ps1'
|
||||
[1.900s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.dsv'
|
||||
[1.901s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.sh'
|
||||
[1.902s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[1.902s] Level 1:colcon.colcon_core.environment:create_environment_scripts_only(arduino_bridge)
|
||||
[1.902s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.ps1'
|
||||
[1.904s] INFO:colcon.colcon_core.shell:Creating package descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.dsv'
|
||||
[1.905s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.sh'
|
||||
[1.907s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.bash'
|
||||
[1.908s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.zsh'
|
||||
[1.909s] Level 1:colcon.colcon_core.environment:create_file_with_runtime_dependencies(/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/colcon-core/packages/arduino_bridge)
|
||||
[1.909s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:closing loop
|
||||
[1.910s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:loop closed
|
||||
[1.910s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete finished with '0'
|
||||
[1.910s] DEBUG:colcon.colcon_core.event_reactor:joining thread
|
||||
[1.927s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.notify_send': Could not find 'notify-send'
|
||||
[1.927s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.terminal_notifier': Not used on non-Darwin systems
|
||||
[1.927s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.win32': Not used on non-Windows systems
|
||||
[1.927s] INFO:colcon.colcon_notification.desktop_notification:Sending desktop notification using 'notify2'
|
||||
[1.930s] DEBUG:colcon.colcon_notification.desktop_notification.notify2:Failed to initialize notify2: org.freedesktop.DBus.Error.Spawn.ExecFailed: /usr/bin/dbus-launch terminated abnormally without any error message
|
||||
[1.931s] DEBUG:colcon.colcon_core.event_reactor:joined thread
|
||||
[1.932s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.ps1'
|
||||
[1.934s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_ps1.py'
|
||||
[1.936s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.ps1'
|
||||
[1.938s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.sh'
|
||||
[1.939s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_sh.py'
|
||||
[1.940s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.sh'
|
||||
[1.941s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.bash'
|
||||
[1.942s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.bash'
|
||||
[1.943s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.zsh'
|
||||
[1.944s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.zsh'
|
||||
@@ -0,0 +1,2 @@
|
||||
Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
@@ -0,0 +1,19 @@
|
||||
running egg_info
|
||||
writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build
|
||||
running build_py
|
||||
running install
|
||||
running install_lib
|
||||
running install_data
|
||||
running install_egg_info
|
||||
removing '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info' (and everything under it)
|
||||
Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
running install_scripts
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
@@ -0,0 +1,19 @@
|
||||
running egg_info
|
||||
writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build
|
||||
running build_py
|
||||
running install
|
||||
running install_lib
|
||||
running install_data
|
||||
running install_egg_info
|
||||
removing '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info' (and everything under it)
|
||||
Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
running install_scripts
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
@@ -0,0 +1,21 @@
|
||||
[1.012s] Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[1.381s] running egg_info
|
||||
[1.382s] writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO
|
||||
[1.382s] writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt
|
||||
[1.382s] writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt
|
||||
[1.383s] writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt
|
||||
[1.383s] writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt
|
||||
[1.386s] reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.387s] writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.387s] running build
|
||||
[1.387s] running build_py
|
||||
[1.387s] running install
|
||||
[1.388s] running install_lib
|
||||
[1.390s] running install_data
|
||||
[1.390s] running install_egg_info
|
||||
[1.393s] removing '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info' (and everything under it)
|
||||
[1.393s] Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info
|
||||
[1.394s] running install_scripts
|
||||
[1.431s] Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
[1.431s] writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'
|
||||
[1.472s] Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
@@ -0,0 +1,40 @@
|
||||
[0.000000] (-) TimerEvent: {}
|
||||
[0.000321] (arduino_bridge) JobQueued: {'identifier': 'arduino_bridge', 'dependencies': OrderedDict()}
|
||||
[0.000578] (arduino_bridge) JobStarted: {'identifier': 'arduino_bridge'}
|
||||
[0.099104] (-) TimerEvent: {}
|
||||
[0.199400] (-) TimerEvent: {}
|
||||
[0.299683] (-) TimerEvent: {}
|
||||
[0.400046] (-) TimerEvent: {}
|
||||
[0.500338] (-) TimerEvent: {}
|
||||
[0.600676] (-) TimerEvent: {}
|
||||
[0.700990] (-) TimerEvent: {}
|
||||
[0.801304] (-) TimerEvent: {}
|
||||
[0.901630] (-) TimerEvent: {}
|
||||
[1.001961] (-) TimerEvent: {}
|
||||
[1.011391] (arduino_bridge) Command: {'cmd': ['/usr/bin/python3', '-W', 'ignore:setup.py install is deprecated', '-W', 'ignore:easy_install command is deprecated', 'setup.py', 'egg_info', '--egg-base', 'build/arduino_bridge', 'build', '--build-base', '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build', 'install', '--record', '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log', '--single-version-externally-managed', 'install_data'], 'cwd': '/home/koray/ros2_ws/arduino_bridge', 'env': {'LESSOPEN': '| /usr/bin/lesspipe %s', 'MESA_LOADER_DRIVER_OVERRIDE': 'iris', 'HOSTNAME': '88d2647bf8bf', 'SHLVL': '1', 'LD_LIBRARY_PATH': '/opt/ros/humble/opt/rviz_ogre_vendor/lib:/opt/ros/humble/lib/x86_64-linux-gnu:/opt/ros/humble/lib', 'HOME': '/home/koray', 'CYCLONEDDS_URI': 'file:///etc/cyclonedds/config.xml', 'OLDPWD': '/home/koray/ros2_ws', 'ROS_PYTHON_VERSION': '3', 'ROS_DISTRO': 'humble', '_': '/usr/bin/colcon', 'ROS_VERSION': '2', 'TERM': 'xterm', 'ROS_LOCALHOST_ONLY': '0', 'PATH': '/opt/ros/humble/bin:/usr/local/sbin:/usr/local/bin:/usr/sbin:/usr/bin:/sbin:/bin', 'DISPLAY': ':0', 'LANG': 'C.UTF-8', 'RMW_IMPLEMENTATION': 'rmw_cyclonedds_cpp', 'LIBVA_DRIVER_NAME': 'i965', 'LS_COLORS': 'rs=0:di=01;34:ln=01;36:mh=00:pi=40;33:so=01;35:do=01;35:bd=40;33;01:cd=40;33;01:or=40;31;01:mi=00:su=37;41:sg=30;43:ca=30;41:tw=30;42:ow=34;42:st=37;44:ex=01;32:*.tar=01;31:*.tgz=01;31:*.arc=01;31:*.arj=01;31:*.taz=01;31:*.lha=01;31:*.lz4=01;31:*.lzh=01;31:*.lzma=01;31:*.tlz=01;31:*.txz=01;31:*.tzo=01;31:*.t7z=01;31:*.zip=01;31:*.z=01;31:*.dz=01;31:*.gz=01;31:*.lrz=01;31:*.lz=01;31:*.lzo=01;31:*.xz=01;31:*.zst=01;31:*.tzst=01;31:*.bz2=01;31:*.bz=01;31:*.tbz=01;31:*.tbz2=01;31:*.tz=01;31:*.deb=01;31:*.rpm=01;31:*.jar=01;31:*.war=01;31:*.ear=01;31:*.sar=01;31:*.rar=01;31:*.alz=01;31:*.ace=01;31:*.zoo=01;31:*.cpio=01;31:*.7z=01;31:*.rz=01;31:*.cab=01;31:*.wim=01;31:*.swm=01;31:*.dwm=01;31:*.esd=01;31:*.jpg=01;35:*.jpeg=01;35:*.mjpg=01;35:*.mjpeg=01;35:*.gif=01;35:*.bmp=01;35:*.pbm=01;35:*.pgm=01;35:*.ppm=01;35:*.tga=01;35:*.xbm=01;35:*.xpm=01;35:*.tif=01;35:*.tiff=01;35:*.png=01;35:*.svg=01;35:*.svgz=01;35:*.mng=01;35:*.pcx=01;35:*.mov=01;35:*.mpg=01;35:*.mpeg=01;35:*.m2v=01;35:*.mkv=01;35:*.webm=01;35:*.webp=01;35:*.ogm=01;35:*.mp4=01;35:*.m4v=01;35:*.mp4v=01;35:*.vob=01;35:*.qt=01;35:*.nuv=01;35:*.wmv=01;35:*.asf=01;35:*.rm=01;35:*.rmvb=01;35:*.flc=01;35:*.avi=01;35:*.fli=01;35:*.flv=01;35:*.gl=01;35:*.dl=01;35:*.xcf=01;35:*.xwd=01;35:*.yuv=01;35:*.cgm=01;35:*.emf=01;35:*.ogv=01;35:*.ogx=01;35:*.aac=00;36:*.au=00;36:*.flac=00;36:*.m4a=00;36:*.mid=00;36:*.midi=00;36:*.mka=00;36:*.mp3=00;36:*.mpc=00;36:*.ogg=00;36:*.ra=00;36:*.wav=00;36:*.oga=00;36:*.opus=00;36:*.spx=00;36:*.xspf=00;36:', 'AMENT_PREFIX_PATH': '/opt/ros/humble', 'DEBIAN_FRONTEND': 'noninteractive', 'SHELL': '/bin/bash', 'LESSCLOSE': '/usr/bin/lesspipe %s %s', 'PWD': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'QT_QPA_PLATFORM': 'xcb', 'LC_ALL': 'C.UTF-8', 'PYTHONPATH': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:/opt/ros/humble/lib/python3.10/site-packages:/opt/ros/humble/local/lib/python3.10/dist-packages', 'COLCON': '1'}, 'shell': False}
|
||||
[1.102090] (-) TimerEvent: {}
|
||||
[1.202395] (-) TimerEvent: {}
|
||||
[1.302691] (-) TimerEvent: {}
|
||||
[1.381392] (arduino_bridge) StdoutLine: {'line': b'running egg_info\n'}
|
||||
[1.382306] (arduino_bridge) StdoutLine: {'line': b'writing build/arduino_bridge/arduino_bridge.egg-info/PKG-INFO\n'}
|
||||
[1.382564] (arduino_bridge) StdoutLine: {'line': b'writing dependency_links to build/arduino_bridge/arduino_bridge.egg-info/dependency_links.txt\n'}
|
||||
[1.382801] (arduino_bridge) StdoutLine: {'line': b'writing entry points to build/arduino_bridge/arduino_bridge.egg-info/entry_points.txt\n'}
|
||||
[1.383043] (arduino_bridge) StdoutLine: {'line': b'writing requirements to build/arduino_bridge/arduino_bridge.egg-info/requires.txt\n'}
|
||||
[1.383240] (arduino_bridge) StdoutLine: {'line': b'writing top-level names to build/arduino_bridge/arduino_bridge.egg-info/top_level.txt\n'}
|
||||
[1.386174] (arduino_bridge) StdoutLine: {'line': b"reading manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.387218] (arduino_bridge) StdoutLine: {'line': b"writing manifest file 'build/arduino_bridge/arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.387468] (arduino_bridge) StdoutLine: {'line': b'running build\n'}
|
||||
[1.387582] (arduino_bridge) StdoutLine: {'line': b'running build_py\n'}
|
||||
[1.387961] (arduino_bridge) StdoutLine: {'line': b'running install\n'}
|
||||
[1.388750] (arduino_bridge) StdoutLine: {'line': b'running install_lib\n'}
|
||||
[1.390425] (arduino_bridge) StdoutLine: {'line': b'running install_data\n'}
|
||||
[1.390643] (arduino_bridge) StdoutLine: {'line': b'running install_egg_info\n'}
|
||||
[1.392944] (arduino_bridge) StdoutLine: {'line': b"removing '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info' (and everything under it)\n"}
|
||||
[1.393361] (arduino_bridge) StdoutLine: {'line': b'Copying build/arduino_bridge/arduino_bridge.egg-info to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino_bridge-0.0.0-py3.10.egg-info\n'}
|
||||
[1.394708] (arduino_bridge) StdoutLine: {'line': b'running install_scripts\n'}
|
||||
[1.402823] (-) TimerEvent: {}
|
||||
[1.431192] (arduino_bridge) StdoutLine: {'line': b'Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge\n'}
|
||||
[1.431700] (arduino_bridge) StdoutLine: {'line': b"writing list of installed files to '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log'\n"}
|
||||
[1.471788] (arduino_bridge) CommandEnded: {'returncode': 0}
|
||||
[1.488960] (arduino_bridge) JobEnded: {'identifier': 'arduino_bridge', 'rc': 0}
|
||||
[1.490321] (-) EventReactorShutdown: {}
|
||||
@@ -0,0 +1,91 @@
|
||||
[0.268s] DEBUG:colcon:Command line arguments: ['/usr/bin/colcon', 'build', '--packages-select', 'arduino_bridge']
|
||||
[0.268s] DEBUG:colcon:Parsed command line arguments: Namespace(log_base=None, log_level=None, verb_name='build', build_base='build', install_base='install', merge_install=False, symlink_install=False, test_result_base=None, continue_on_error=False, executor='parallel', parallel_workers=4, event_handlers=None, ignore_user_meta=False, metas=['./colcon.meta'], base_paths=['.'], packages_ignore=None, packages_ignore_regex=None, paths=None, packages_up_to=None, packages_up_to_regex=None, packages_above=None, packages_above_and_dependencies=None, packages_above_depth=None, packages_select_by_dep=None, packages_skip_by_dep=None, packages_skip_up_to=None, packages_select_build_failed=False, packages_skip_build_finished=False, packages_select_test_failures=False, packages_skip_test_passed=False, packages_select=['arduino_bridge'], packages_skip=None, packages_select_regex=None, packages_skip_regex=None, packages_start=None, packages_end=None, allow_overriding=[], cmake_args=None, cmake_target=None, cmake_target_skip_unavailable=False, cmake_clean_cache=False, cmake_clean_first=False, cmake_force_configure=False, ament_cmake_args=None, catkin_cmake_args=None, catkin_skip_building_tests=False, verb_parser=<colcon_defaults.argument_parser.defaults.DefaultArgumentsDecorator object at 0x7fcd7b89a4d0>, verb_extension=<colcon_core.verb.build.BuildVerb object at 0x7fcd7b899e10>, main=<bound method BuildVerb.main of <colcon_core.verb.build.BuildVerb object at 0x7fcd7b899e10>>)
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) check parameters
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) check parameters
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) check parameters
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) check parameters
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) discover
|
||||
[0.532s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) discover
|
||||
[0.532s] INFO:colcon.colcon_core.package_discovery:Crawling recursively for packages in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[0.532s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ignore', 'ignore_ament_install']
|
||||
[0.532s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore'
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore_ament_install'
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_pkg']
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_pkg'
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_meta']
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_meta'
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ros']
|
||||
[0.533s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ros'
|
||||
[0.556s] DEBUG:colcon.colcon_core.package_identification:Package '.' with type 'ros.ament_python' and name 'arduino_bridge'
|
||||
[0.556s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) using defaults
|
||||
[0.557s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) discover
|
||||
[0.557s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) using defaults
|
||||
[0.557s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) discover
|
||||
[0.557s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) using defaults
|
||||
[0.589s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) check parameters
|
||||
[0.589s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) discover
|
||||
[0.595s] DEBUG:colcon.colcon_installed_package_information.package_discovery:Found 288 installed packages in /opt/ros/humble
|
||||
[0.597s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) using defaults
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_args' from command line to 'None'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target' from command line to 'None'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target_skip_unavailable' from command line to 'False'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_cache' from command line to 'False'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_first' from command line to 'False'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_force_configure' from command line to 'False'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'ament_cmake_args' from command line to 'None'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_cmake_args' from command line to 'None'
|
||||
[0.680s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_skip_building_tests' from command line to 'False'
|
||||
[0.680s] DEBUG:colcon.colcon_core.verb:Building package 'arduino_bridge' with the following arguments: {'ament_cmake_args': None, 'build_base': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'catkin_cmake_args': None, 'catkin_skip_building_tests': False, 'cmake_args': None, 'cmake_clean_cache': False, 'cmake_clean_first': False, 'cmake_force_configure': False, 'cmake_target': None, 'cmake_target_skip_unavailable': False, 'install_base': '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge', 'merge_install': False, 'path': '/home/koray/ros2_ws/arduino_bridge', 'symlink_install': False, 'test_result_base': None}
|
||||
[0.681s] INFO:colcon.colcon_core.executor:Executing jobs using 'parallel' executor
|
||||
[0.682s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete
|
||||
[0.682s] INFO:colcon.colcon_ros.task.ament_python.build:Building ROS package in '/home/koray/ros2_ws/arduino_bridge' with build type 'ament_python'
|
||||
[0.682s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'ament_prefix_path')
|
||||
[0.687s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_core.shell.bat': Not used on non-Windows systems
|
||||
[0.687s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.ps1'
|
||||
[0.689s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.dsv'
|
||||
[0.690s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.sh'
|
||||
[0.691s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[0.691s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[1.146s] INFO:colcon.colcon_core.task.python.build:Building Python package in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[1.147s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[1.147s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[1.695s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoking command in '/home/koray/ros2_ws/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[2.155s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoked command in '/home/koray/ros2_ws/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py egg_info --egg-base build/arduino_bridge build --build-base /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build install --record /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/install.log --single-version-externally-managed install_data
|
||||
[2.160s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake module files
|
||||
[2.161s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake config files
|
||||
[2.162s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib'
|
||||
[2.162s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[2.162s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/pkgconfig/arduino_bridge.pc'
|
||||
[2.163s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages'
|
||||
[2.163s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'pythonpath')
|
||||
[2.163s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.ps1'
|
||||
[2.164s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.dsv'
|
||||
[2.165s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.sh'
|
||||
[2.165s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[2.165s] Level 1:colcon.colcon_core.environment:create_environment_scripts_only(arduino_bridge)
|
||||
[2.166s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.ps1'
|
||||
[2.167s] INFO:colcon.colcon_core.shell:Creating package descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.dsv'
|
||||
[2.168s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.sh'
|
||||
[2.169s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.bash'
|
||||
[2.170s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.zsh'
|
||||
[2.171s] Level 1:colcon.colcon_core.environment:create_file_with_runtime_dependencies(/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/colcon-core/packages/arduino_bridge)
|
||||
[2.171s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:closing loop
|
||||
[2.172s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:loop closed
|
||||
[2.172s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete finished with '0'
|
||||
[2.172s] DEBUG:colcon.colcon_core.event_reactor:joining thread
|
||||
[2.180s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.notify_send': Could not find 'notify-send'
|
||||
[2.180s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.terminal_notifier': Not used on non-Darwin systems
|
||||
[2.180s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.win32': Not used on non-Windows systems
|
||||
[2.180s] INFO:colcon.colcon_notification.desktop_notification:Sending desktop notification using 'notify2'
|
||||
[2.187s] DEBUG:colcon.colcon_notification.desktop_notification.notify2:Failed to initialize notify2: org.freedesktop.DBus.Error.Spawn.ExecFailed: /usr/bin/dbus-launch terminated abnormally without any error message
|
||||
[2.187s] DEBUG:colcon.colcon_core.event_reactor:joined thread
|
||||
[2.189s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.ps1'
|
||||
[2.191s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_ps1.py'
|
||||
[2.194s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.ps1'
|
||||
[2.195s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.sh'
|
||||
[2.196s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_sh.py'
|
||||
[2.197s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.sh'
|
||||
[2.199s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.bash'
|
||||
[2.200s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.bash'
|
||||
[2.201s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.zsh'
|
||||
[2.202s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.zsh'
|
||||
@@ -0,0 +1,2 @@
|
||||
Invoking command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
Invoked command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
@@ -0,0 +1,17 @@
|
||||
running develop
|
||||
running egg_info
|
||||
writing arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to arduino_bridge.egg-info/top_level.txt
|
||||
reading manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build_ext
|
||||
Creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino-bridge.egg-link (link to .)
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
|
||||
Installed /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
running symlink_data
|
||||
symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
@@ -0,0 +1,17 @@
|
||||
running develop
|
||||
running egg_info
|
||||
writing arduino_bridge.egg-info/PKG-INFO
|
||||
writing dependency_links to arduino_bridge.egg-info/dependency_links.txt
|
||||
writing entry points to arduino_bridge.egg-info/entry_points.txt
|
||||
writing requirements to arduino_bridge.egg-info/requires.txt
|
||||
writing top-level names to arduino_bridge.egg-info/top_level.txt
|
||||
reading manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
writing manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
running build_ext
|
||||
Creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino-bridge.egg-link (link to .)
|
||||
Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
|
||||
Installed /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
running symlink_data
|
||||
symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
@@ -0,0 +1,19 @@
|
||||
[0.803s] Invoking command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
[1.131s] running develop
|
||||
[1.309s] running egg_info
|
||||
[1.309s] writing arduino_bridge.egg-info/PKG-INFO
|
||||
[1.309s] writing dependency_links to arduino_bridge.egg-info/dependency_links.txt
|
||||
[1.309s] writing entry points to arduino_bridge.egg-info/entry_points.txt
|
||||
[1.309s] writing requirements to arduino_bridge.egg-info/requires.txt
|
||||
[1.310s] writing top-level names to arduino_bridge.egg-info/top_level.txt
|
||||
[1.312s] reading manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.313s] writing manifest file 'arduino_bridge.egg-info/SOURCES.txt'
|
||||
[1.315s] running build_ext
|
||||
[1.316s] Creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino-bridge.egg-link (link to .)
|
||||
[1.317s] Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge
|
||||
[1.317s]
|
||||
[1.318s] Installed /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge
|
||||
[1.318s] running symlink_data
|
||||
[1.318s] symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages
|
||||
[1.318s] symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge
|
||||
[1.355s] Invoked command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
@@ -0,0 +1,37 @@
|
||||
[0.000000] (-) TimerEvent: {}
|
||||
[0.001264] (arduino_bridge) JobQueued: {'identifier': 'arduino_bridge', 'dependencies': OrderedDict()}
|
||||
[0.001383] (arduino_bridge) JobStarted: {'identifier': 'arduino_bridge'}
|
||||
[0.099721] (-) TimerEvent: {}
|
||||
[0.200031] (-) TimerEvent: {}
|
||||
[0.300319] (-) TimerEvent: {}
|
||||
[0.400599] (-) TimerEvent: {}
|
||||
[0.500913] (-) TimerEvent: {}
|
||||
[0.601197] (-) TimerEvent: {}
|
||||
[0.701497] (-) TimerEvent: {}
|
||||
[0.801797] (-) TimerEvent: {}
|
||||
[0.803279] (arduino_bridge) Command: {'cmd': ['/usr/bin/python3', '-W', 'ignore:setup.py install is deprecated', '-W', 'ignore:easy_install command is deprecated', 'setup.py', 'develop', '--editable', '--build-directory', '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build', '--no-deps', 'symlink_data', '--force'], 'cwd': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'env': {'LESSOPEN': '| /usr/bin/lesspipe %s', 'MESA_LOADER_DRIVER_OVERRIDE': 'iris', 'HOSTNAME': '983a254c47a9', 'SHLVL': '1', 'LD_LIBRARY_PATH': '/opt/ros/humble/opt/rviz_ogre_vendor/lib:/opt/ros/humble/lib/x86_64-linux-gnu:/opt/ros/humble/lib', 'HOME': '/home/koray', 'CYCLONEDDS_URI': 'file:///etc/cyclonedds/config.xml', 'OLDPWD': '/home/koray/ros2_ws', 'ROS_PYTHON_VERSION': '3', 'ROS_DISTRO': 'humble', '_': '/usr/bin/colcon', 'ROS_VERSION': '2', 'TERM': 'xterm', 'ROS_LOCALHOST_ONLY': '0', 'PATH': '/opt/ros/humble/bin:/usr/local/sbin:/usr/local/bin:/usr/sbin:/usr/bin:/sbin:/bin', 'DISPLAY': ':0', 'LANG': 'C.UTF-8', 'RMW_IMPLEMENTATION': 'rmw_cyclonedds_cpp', 'LIBVA_DRIVER_NAME': 'i965', 'LS_COLORS': 'rs=0:di=01;34:ln=01;36:mh=00:pi=40;33:so=01;35:do=01;35:bd=40;33;01:cd=40;33;01:or=40;31;01:mi=00:su=37;41:sg=30;43:ca=30;41:tw=30;42:ow=34;42:st=37;44:ex=01;32:*.tar=01;31:*.tgz=01;31:*.arc=01;31:*.arj=01;31:*.taz=01;31:*.lha=01;31:*.lz4=01;31:*.lzh=01;31:*.lzma=01;31:*.tlz=01;31:*.txz=01;31:*.tzo=01;31:*.t7z=01;31:*.zip=01;31:*.z=01;31:*.dz=01;31:*.gz=01;31:*.lrz=01;31:*.lz=01;31:*.lzo=01;31:*.xz=01;31:*.zst=01;31:*.tzst=01;31:*.bz2=01;31:*.bz=01;31:*.tbz=01;31:*.tbz2=01;31:*.tz=01;31:*.deb=01;31:*.rpm=01;31:*.jar=01;31:*.war=01;31:*.ear=01;31:*.sar=01;31:*.rar=01;31:*.alz=01;31:*.ace=01;31:*.zoo=01;31:*.cpio=01;31:*.7z=01;31:*.rz=01;31:*.cab=01;31:*.wim=01;31:*.swm=01;31:*.dwm=01;31:*.esd=01;31:*.jpg=01;35:*.jpeg=01;35:*.mjpg=01;35:*.mjpeg=01;35:*.gif=01;35:*.bmp=01;35:*.pbm=01;35:*.pgm=01;35:*.ppm=01;35:*.tga=01;35:*.xbm=01;35:*.xpm=01;35:*.tif=01;35:*.tiff=01;35:*.png=01;35:*.svg=01;35:*.svgz=01;35:*.mng=01;35:*.pcx=01;35:*.mov=01;35:*.mpg=01;35:*.mpeg=01;35:*.m2v=01;35:*.mkv=01;35:*.webm=01;35:*.webp=01;35:*.ogm=01;35:*.mp4=01;35:*.m4v=01;35:*.mp4v=01;35:*.vob=01;35:*.qt=01;35:*.nuv=01;35:*.wmv=01;35:*.asf=01;35:*.rm=01;35:*.rmvb=01;35:*.flc=01;35:*.avi=01;35:*.fli=01;35:*.flv=01;35:*.gl=01;35:*.dl=01;35:*.xcf=01;35:*.xwd=01;35:*.yuv=01;35:*.cgm=01;35:*.emf=01;35:*.ogv=01;35:*.ogx=01;35:*.aac=00;36:*.au=00;36:*.flac=00;36:*.m4a=00;36:*.mid=00;36:*.midi=00;36:*.mka=00;36:*.mp3=00;36:*.mpc=00;36:*.ogg=00;36:*.ra=00;36:*.wav=00;36:*.oga=00;36:*.opus=00;36:*.spx=00;36:*.xspf=00;36:', 'AMENT_PREFIX_PATH': '/opt/ros/humble', 'DEBIAN_FRONTEND': 'noninteractive', 'SHELL': '/bin/bash', 'LESSCLOSE': '/usr/bin/lesspipe %s %s', 'PWD': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'QT_QPA_PLATFORM': 'xcb', 'LC_ALL': 'C.UTF-8', 'PYTHONPATH': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:/opt/ros/humble/lib/python3.10/site-packages:/opt/ros/humble/local/lib/python3.10/dist-packages', 'COLCON': '1'}, 'shell': False}
|
||||
[0.901933] (-) TimerEvent: {}
|
||||
[1.002251] (-) TimerEvent: {}
|
||||
[1.102537] (-) TimerEvent: {}
|
||||
[1.131969] (arduino_bridge) StdoutLine: {'line': b'running develop\n'}
|
||||
[1.202606] (-) TimerEvent: {}
|
||||
[1.302919] (-) TimerEvent: {}
|
||||
[1.309964] (arduino_bridge) StdoutLine: {'line': b'running egg_info\n'}
|
||||
[1.310221] (arduino_bridge) StdoutLine: {'line': b'writing arduino_bridge.egg-info/PKG-INFO\n'}
|
||||
[1.310455] (arduino_bridge) StdoutLine: {'line': b'writing dependency_links to arduino_bridge.egg-info/dependency_links.txt\n'}
|
||||
[1.310703] (arduino_bridge) StdoutLine: {'line': b'writing entry points to arduino_bridge.egg-info/entry_points.txt\n'}
|
||||
[1.310862] (arduino_bridge) StdoutLine: {'line': b'writing requirements to arduino_bridge.egg-info/requires.txt\n'}
|
||||
[1.310997] (arduino_bridge) StdoutLine: {'line': b'writing top-level names to arduino_bridge.egg-info/top_level.txt\n'}
|
||||
[1.313724] (arduino_bridge) StdoutLine: {'line': b"reading manifest file 'arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.314678] (arduino_bridge) StdoutLine: {'line': b"writing manifest file 'arduino_bridge.egg-info/SOURCES.txt'\n"}
|
||||
[1.316694] (arduino_bridge) StdoutLine: {'line': b'running build_ext\n'}
|
||||
[1.317161] (arduino_bridge) StdoutLine: {'line': b'Creating /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages/arduino-bridge.egg-link (link to .)\n'}
|
||||
[1.318277] (arduino_bridge) StdoutLine: {'line': b'Installing arduino_bridge script to /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge\n'}
|
||||
[1.318773] (arduino_bridge) StdoutLine: {'line': b'\n'}
|
||||
[1.319003] (arduino_bridge) StdoutLine: {'line': b'Installed /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge\n'}
|
||||
[1.319161] (arduino_bridge) StdoutLine: {'line': b'running symlink_data\n'}
|
||||
[1.319369] (arduino_bridge) StdoutLine: {'line': b'symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/resource/arduino_bridge -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages\n'}
|
||||
[1.319616] (arduino_bridge) StdoutLine: {'line': b'symbolically linking /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/package.xml -> /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge\n'}
|
||||
[1.355484] (arduino_bridge) CommandEnded: {'returncode': 0}
|
||||
[1.373615] (arduino_bridge) JobEnded: {'identifier': 'arduino_bridge', 'rc': 0}
|
||||
[1.374602] (-) EventReactorShutdown: {}
|
||||
@@ -0,0 +1,98 @@
|
||||
[0.210s] DEBUG:colcon:Command line arguments: ['/usr/bin/colcon', 'build', '--symlink-install']
|
||||
[0.210s] DEBUG:colcon:Parsed command line arguments: Namespace(log_base=None, log_level=None, verb_name='build', build_base='build', install_base='install', merge_install=False, symlink_install=True, test_result_base=None, continue_on_error=False, executor='parallel', parallel_workers=4, event_handlers=None, ignore_user_meta=False, metas=['./colcon.meta'], base_paths=['.'], packages_ignore=None, packages_ignore_regex=None, paths=None, packages_up_to=None, packages_up_to_regex=None, packages_above=None, packages_above_and_dependencies=None, packages_above_depth=None, packages_select_by_dep=None, packages_skip_by_dep=None, packages_skip_up_to=None, packages_select_build_failed=False, packages_skip_build_finished=False, packages_select_test_failures=False, packages_skip_test_passed=False, packages_select=None, packages_skip=None, packages_select_regex=None, packages_skip_regex=None, packages_start=None, packages_end=None, allow_overriding=[], cmake_args=None, cmake_target=None, cmake_target_skip_unavailable=False, cmake_clean_cache=False, cmake_clean_first=False, cmake_force_configure=False, ament_cmake_args=None, catkin_cmake_args=None, catkin_skip_building_tests=False, verb_parser=<colcon_defaults.argument_parser.defaults.DefaultArgumentsDecorator object at 0x7fc9f6c624a0>, verb_extension=<colcon_core.verb.build.BuildVerb object at 0x7fc9f6c61de0>, main=<bound method BuildVerb.main of <colcon_core.verb.build.BuildVerb object at 0x7fc9f6c61de0>>)
|
||||
[0.405s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) check parameters
|
||||
[0.405s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) check parameters
|
||||
[0.406s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) check parameters
|
||||
[0.406s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) check parameters
|
||||
[0.406s] Level 1:colcon.colcon_core.package_discovery:discover_packages(colcon_meta) discover
|
||||
[0.406s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) discover
|
||||
[0.406s] INFO:colcon.colcon_core.package_discovery:Crawling recursively for packages in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ignore', 'ignore_ament_install']
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore'
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ignore_ament_install'
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_pkg']
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_pkg'
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['colcon_meta']
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'colcon_meta'
|
||||
[0.406s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extensions ['ros']
|
||||
[0.407s] Level 1:colcon.colcon_core.package_identification:_identify(.) by extension 'ros'
|
||||
[0.433s] DEBUG:colcon.colcon_core.package_identification:Package '.' with type 'ros.ament_python' and name 'arduino_bridge'
|
||||
[0.434s] Level 1:colcon.colcon_core.package_discovery:discover_packages(recursive) using defaults
|
||||
[0.434s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) discover
|
||||
[0.434s] Level 1:colcon.colcon_core.package_discovery:discover_packages(ignore) using defaults
|
||||
[0.434s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) discover
|
||||
[0.434s] Level 1:colcon.colcon_core.package_discovery:discover_packages(path) using defaults
|
||||
[0.468s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) check parameters
|
||||
[0.468s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) discover
|
||||
[0.475s] DEBUG:colcon.colcon_installed_package_information.package_discovery:Found 288 installed packages in /opt/ros/humble
|
||||
[0.476s] Level 1:colcon.colcon_core.package_discovery:discover_packages(prefix_path) using defaults
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_args' from command line to 'None'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target' from command line to 'None'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_target_skip_unavailable' from command line to 'False'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_cache' from command line to 'False'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_clean_first' from command line to 'False'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'cmake_force_configure' from command line to 'False'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'ament_cmake_args' from command line to 'None'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_cmake_args' from command line to 'None'
|
||||
[0.543s] Level 5:colcon.colcon_core.verb:set package 'arduino_bridge' build argument 'catkin_skip_building_tests' from command line to 'False'
|
||||
[0.543s] DEBUG:colcon.colcon_core.verb:Building package 'arduino_bridge' with the following arguments: {'ament_cmake_args': None, 'build_base': '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge', 'catkin_cmake_args': None, 'catkin_skip_building_tests': False, 'cmake_args': None, 'cmake_clean_cache': False, 'cmake_clean_first': False, 'cmake_force_configure': False, 'cmake_target': None, 'cmake_target_skip_unavailable': False, 'install_base': '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge', 'merge_install': False, 'path': '/home/koray/ros2_ws/arduino_bridge', 'symlink_install': True, 'test_result_base': None}
|
||||
[0.543s] INFO:colcon.colcon_core.executor:Executing jobs using 'parallel' executor
|
||||
[0.545s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete
|
||||
[0.545s] INFO:colcon.colcon_ros.task.ament_python.build:Building ROS package in '/home/koray/ros2_ws/arduino_bridge' with build type 'ament_python'
|
||||
[0.545s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'ament_prefix_path')
|
||||
[0.552s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_core.shell.bat': Not used on non-Windows systems
|
||||
[0.552s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.ps1'
|
||||
[0.553s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.dsv'
|
||||
[0.554s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/ament_prefix_path.sh'
|
||||
[0.555s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[0.555s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[0.887s] INFO:colcon.colcon_core.task.python.build:Building Python package in '/home/koray/ros2_ws/arduino_bridge'
|
||||
[0.888s] INFO:colcon.colcon_core.shell:Skip shell extension 'powershell' for command environment: Not usable outside of PowerShell
|
||||
[0.888s] DEBUG:colcon.colcon_core.shell:Skip shell extension 'dsv' for command environment
|
||||
[1.346s] DEBUG:colcon.colcon_core.task.python.build:While undoing a previous installation files outside the Python library path are being ignored: /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/ament_index/resource_index/packages/arduino_bridge
|
||||
[1.346s] DEBUG:colcon.colcon_core.task.python.build:While undoing a previous installation files outside the Python library path are being ignored: /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.xml
|
||||
[1.346s] DEBUG:colcon.colcon_core.task.python.build:While undoing a previous installation files outside the Python library path are being ignored: /home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/arduino_bridge/arduino_bridge
|
||||
[1.348s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoking command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
[1.900s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'pythonpath_develop')
|
||||
[1.900s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.ps1'
|
||||
[1.901s] DEBUG:colcon.colcon_core.event_handler.log_command:Invoked command in '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge' returned '0': PYTHONPATH=/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/prefix_override:/usr/lib/python3/dist-packages/colcon_core/task/python/colcon_distutils_commands:/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages:${PYTHONPATH} /usr/bin/python3 -W ignore:setup.py install is deprecated -W ignore:easy_install command is deprecated setup.py develop --editable --build-directory /home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/build --no-deps symlink_data --force
|
||||
[1.901s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.dsv'
|
||||
[1.902s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/build/arduino_bridge/share/arduino_bridge/hook/pythonpath_develop.sh'
|
||||
[1.907s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake module files
|
||||
[1.908s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge' for CMake config files
|
||||
[1.909s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib'
|
||||
[1.909s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[1.909s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/pkgconfig/arduino_bridge.pc'
|
||||
[1.909s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/lib/python3.10/site-packages'
|
||||
[1.909s] Level 1:colcon.colcon_core.shell:create_environment_hook('arduino_bridge', 'pythonpath')
|
||||
[1.910s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.ps1'
|
||||
[1.910s] INFO:colcon.colcon_core.shell:Creating environment descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.dsv'
|
||||
[1.911s] INFO:colcon.colcon_core.shell:Creating environment hook '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/hook/pythonpath.sh'
|
||||
[1.911s] Level 1:colcon.colcon_core.environment:checking '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/bin'
|
||||
[1.911s] Level 1:colcon.colcon_core.environment:create_environment_scripts_only(arduino_bridge)
|
||||
[1.912s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.ps1'
|
||||
[1.913s] INFO:colcon.colcon_core.shell:Creating package descriptor '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.dsv'
|
||||
[1.914s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.sh'
|
||||
[1.915s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.bash'
|
||||
[1.916s] INFO:colcon.colcon_core.shell:Creating package script '/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/arduino_bridge/package.zsh'
|
||||
[1.917s] Level 1:colcon.colcon_core.environment:create_file_with_runtime_dependencies(/home/koray/ros2_ws/arduino_bridge/install/arduino_bridge/share/colcon-core/packages/arduino_bridge)
|
||||
[1.918s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:closing loop
|
||||
[1.918s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:loop closed
|
||||
[1.918s] DEBUG:colcon.colcon_parallel_executor.executor.parallel:run_until_complete finished with '0'
|
||||
[1.918s] DEBUG:colcon.colcon_core.event_reactor:joining thread
|
||||
[1.930s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.notify_send': Could not find 'notify-send'
|
||||
[1.930s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.terminal_notifier': Not used on non-Darwin systems
|
||||
[1.931s] INFO:colcon.colcon_core.plugin_system:Skipping extension 'colcon_notification.desktop_notification.win32': Not used on non-Windows systems
|
||||
[1.931s] INFO:colcon.colcon_notification.desktop_notification:Sending desktop notification using 'notify2'
|
||||
[1.934s] DEBUG:colcon.colcon_notification.desktop_notification.notify2:Failed to initialize notify2: org.freedesktop.DBus.Error.Spawn.ExecFailed: /usr/bin/dbus-launch terminated abnormally without any error message
|
||||
[1.935s] DEBUG:colcon.colcon_core.event_reactor:joined thread
|
||||
[1.936s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.ps1'
|
||||
[1.939s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_ps1.py'
|
||||
[1.941s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.ps1'
|
||||
[1.943s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.sh'
|
||||
[1.945s] INFO:colcon.colcon_core.shell:Creating prefix util module '/home/koray/ros2_ws/arduino_bridge/install/_local_setup_util_sh.py'
|
||||
[1.946s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.sh'
|
||||
[1.948s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.bash'
|
||||
[1.950s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.bash'
|
||||
[1.951s] INFO:colcon.colcon_core.shell:Creating prefix script '/home/koray/ros2_ws/arduino_bridge/install/local_setup.zsh'
|
||||
[1.952s] INFO:colcon.colcon_core.shell:Creating prefix chain script '/home/koray/ros2_ws/arduino_bridge/install/setup.zsh'
|
||||
1
ros2_ws/src/arduino_bridge/log/latest
Symbolic link
1
ros2_ws/src/arduino_bridge/log/latest
Symbolic link
@@ -0,0 +1 @@
|
||||
latest_build
|
||||
1
ros2_ws/src/arduino_bridge/log/latest_build
Symbolic link
1
ros2_ws/src/arduino_bridge/log/latest_build
Symbolic link
@@ -0,0 +1 @@
|
||||
build_2025-07-09_20-01-59
|
||||
18
ros2_ws/src/arduino_bridge/package.xml
Normal file
18
ros2_ws/src/arduino_bridge/package.xml
Normal file
@@ -0,0 +1,18 @@
|
||||
<?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>arduino_bridge</name>
|
||||
<version>0.0.0</version>
|
||||
<description>TODO: Package description</description>
|
||||
<maintainer email="koray@todo.todo">koray</maintainer>
|
||||
<license>TODO: License declaration</license>
|
||||
|
||||
<test_depend>ament_copyright</test_depend>
|
||||
<test_depend>ament_flake8</test_depend>
|
||||
<test_depend>ament_pep257</test_depend>
|
||||
<test_depend>python3-pytest</test_depend>
|
||||
|
||||
<export>
|
||||
<build_type>ament_python</build_type>
|
||||
</export>
|
||||
</package>
|
||||
0
ros2_ws/src/arduino_bridge/resource/arduino_bridge
Normal file
0
ros2_ws/src/arduino_bridge/resource/arduino_bridge
Normal file
4
ros2_ws/src/arduino_bridge/setup.cfg
Normal file
4
ros2_ws/src/arduino_bridge/setup.cfg
Normal file
@@ -0,0 +1,4 @@
|
||||
[develop]
|
||||
script_dir=$base/lib/arduino_bridge
|
||||
[install]
|
||||
install_scripts=$base/lib/arduino_bridge
|
||||
26
ros2_ws/src/arduino_bridge/setup.py
Normal file
26
ros2_ws/src/arduino_bridge/setup.py
Normal file
@@ -0,0 +1,26 @@
|
||||
from setuptools import find_packages, setup
|
||||
|
||||
package_name = 'arduino_bridge'
|
||||
|
||||
setup(
|
||||
name=package_name,
|
||||
version='0.0.0',
|
||||
packages=find_packages(exclude=['test']),
|
||||
data_files=[
|
||||
('share/ament_index/resource_index/packages',
|
||||
['resource/' + package_name]),
|
||||
('share/' + package_name, ['package.xml']),
|
||||
],
|
||||
install_requires=['setuptools'],
|
||||
zip_safe=True,
|
||||
maintainer='koray',
|
||||
maintainer_email='koray@todo.todo',
|
||||
description='TODO: Package description',
|
||||
license='TODO: License declaration',
|
||||
tests_require=['pytest'],
|
||||
entry_points={
|
||||
'console_scripts': [
|
||||
'arduino_bridge = arduino_bridge.arduino_bridge:main',
|
||||
],
|
||||
},
|
||||
)
|
||||
25
ros2_ws/src/arduino_bridge/test/test_copyright.py
Normal file
25
ros2_ws/src/arduino_bridge/test/test_copyright.py
Normal file
@@ -0,0 +1,25 @@
|
||||
# Copyright 2015 Open Source Robotics Foundation, Inc.
|
||||
#
|
||||
# Licensed under the Apache License, Version 2.0 (the "License");
|
||||
# you may not use this file except in compliance with the License.
|
||||
# You may obtain a copy of the License at
|
||||
#
|
||||
# http://www.apache.org/licenses/LICENSE-2.0
|
||||
#
|
||||
# Unless required by applicable law or agreed to in writing, software
|
||||
# distributed under the License is distributed on an "AS IS" BASIS,
|
||||
# WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
|
||||
# See the License for the specific language governing permissions and
|
||||
# limitations under the License.
|
||||
|
||||
from ament_copyright.main import main
|
||||
import pytest
|
||||
|
||||
|
||||
# Remove the `skip` decorator once the source file(s) have a copyright header
|
||||
@pytest.mark.skip(reason='No copyright header has been placed in the generated source file.')
|
||||
@pytest.mark.copyright
|
||||
@pytest.mark.linter
|
||||
def test_copyright():
|
||||
rc = main(argv=['.', 'test'])
|
||||
assert rc == 0, 'Found errors'
|
||||
25
ros2_ws/src/arduino_bridge/test/test_flake8.py
Normal file
25
ros2_ws/src/arduino_bridge/test/test_flake8.py
Normal file
@@ -0,0 +1,25 @@
|
||||
# Copyright 2017 Open Source Robotics Foundation, Inc.
|
||||
#
|
||||
# Licensed under the Apache License, Version 2.0 (the "License");
|
||||
# you may not use this file except in compliance with the License.
|
||||
# You may obtain a copy of the License at
|
||||
#
|
||||
# http://www.apache.org/licenses/LICENSE-2.0
|
||||
#
|
||||
# Unless required by applicable law or agreed to in writing, software
|
||||
# distributed under the License is distributed on an "AS IS" BASIS,
|
||||
# WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
|
||||
# See the License for the specific language governing permissions and
|
||||
# limitations under the License.
|
||||
|
||||
from ament_flake8.main import main_with_errors
|
||||
import pytest
|
||||
|
||||
|
||||
@pytest.mark.flake8
|
||||
@pytest.mark.linter
|
||||
def test_flake8():
|
||||
rc, errors = main_with_errors(argv=[])
|
||||
assert rc == 0, \
|
||||
'Found %d code style errors / warnings:\n' % len(errors) + \
|
||||
'\n'.join(errors)
|
||||
23
ros2_ws/src/arduino_bridge/test/test_pep257.py
Normal file
23
ros2_ws/src/arduino_bridge/test/test_pep257.py
Normal file
@@ -0,0 +1,23 @@
|
||||
# Copyright 2015 Open Source Robotics Foundation, Inc.
|
||||
#
|
||||
# Licensed under the Apache License, Version 2.0 (the "License");
|
||||
# you may not use this file except in compliance with the License.
|
||||
# You may obtain a copy of the License at
|
||||
#
|
||||
# http://www.apache.org/licenses/LICENSE-2.0
|
||||
#
|
||||
# Unless required by applicable law or agreed to in writing, software
|
||||
# distributed under the License is distributed on an "AS IS" BASIS,
|
||||
# WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
|
||||
# See the License for the specific language governing permissions and
|
||||
# limitations under the License.
|
||||
|
||||
from ament_pep257.main import main
|
||||
import pytest
|
||||
|
||||
|
||||
@pytest.mark.linter
|
||||
@pytest.mark.pep257
|
||||
def test_pep257():
|
||||
rc = main(argv=['.', 'test'])
|
||||
assert rc == 0, 'Found code style errors / warnings'
|
||||
21
ros2_ws/src/arduino_bridge_cpp/CMakeLists.txt
Normal file
21
ros2_ws/src/arduino_bridge_cpp/CMakeLists.txt
Normal file
@@ -0,0 +1,21 @@
|
||||
cmake_minimum_required(VERSION 3.5)
|
||||
project(arduino_bridge_cpp)
|
||||
|
||||
find_package(ament_cmake REQUIRED)
|
||||
find_package(rclcpp REQUIRED)
|
||||
find_package(std_msgs REQUIRED)
|
||||
|
||||
add_executable(arduino_bridge src/arduino_bridge.cpp)
|
||||
|
||||
ament_target_dependencies(
|
||||
arduino_bridge
|
||||
rclcpp
|
||||
std_msgs
|
||||
)
|
||||
|
||||
install(TARGETS
|
||||
arduino_bridge
|
||||
DESTINATION lib/${PROJECT_NAME})
|
||||
|
||||
ament_package()
|
||||
|
||||
18
ros2_ws/src/arduino_bridge_cpp/package.xml
Normal file
18
ros2_ws/src/arduino_bridge_cpp/package.xml
Normal file
@@ -0,0 +1,18 @@
|
||||
<?xml version="1.0"?>
|
||||
<package format="3">
|
||||
<name>arduino_bridge_cpp</name>
|
||||
<version>0.0.1</version>
|
||||
<description>Simple C++ bridge for Arduino water sensor + servo</description>
|
||||
<maintainer email="you@example.com">Your Name</maintainer>
|
||||
<license>Apache-2.0</license>
|
||||
|
||||
<buildtool_depend>ament_cmake</buildtool_depend>
|
||||
|
||||
<depend>rclcpp</depend>
|
||||
<depend>std_msgs</depend>
|
||||
|
||||
<export>
|
||||
<build_type>ament_cmake</build_type>
|
||||
</export>
|
||||
</package>
|
||||
|
||||
117
ros2_ws/src/arduino_bridge_cpp/src/arduino_bridge.cpp
Normal file
117
ros2_ws/src/arduino_bridge_cpp/src/arduino_bridge.cpp
Normal file
@@ -0,0 +1,117 @@
|
||||
#include "rclcpp/rclcpp.hpp"
|
||||
#include "std_msgs/msg/int32.hpp"
|
||||
|
||||
#include <iostream>
|
||||
#include <string>
|
||||
#include <sstream>
|
||||
#include <fstream>
|
||||
#include <fcntl.h>
|
||||
#include <termios.h>
|
||||
#include <unistd.h>
|
||||
|
||||
class ArduinoBridge : public rclcpp::Node
|
||||
{
|
||||
public:
|
||||
ArduinoBridge()
|
||||
: Node("arduino_bridge_cpp"), pos_(SERVO_HOME)
|
||||
{
|
||||
device_ = "/dev/ttyUSB0";
|
||||
baud_ = B9600;
|
||||
|
||||
fd_ = open(device_.c_str(), O_RDWR | O_NOCTTY | O_NDELAY);
|
||||
if (fd_ == -1) {
|
||||
RCLCPP_ERROR(this->get_logger(), "Failed to open serial port");
|
||||
exit(1);
|
||||
}
|
||||
fcntl(fd_, F_SETFL, 0);
|
||||
|
||||
struct termios options;
|
||||
tcgetattr(fd_, &options);
|
||||
cfsetispeed(&options, baud_);
|
||||
cfsetospeed(&options, baud_);
|
||||
options.c_cflag |= (CLOCAL | CREAD);
|
||||
options.c_cflag &= ~PARENB;
|
||||
options.c_cflag &= ~CSTOPB;
|
||||
options.c_cflag &= ~CSIZE;
|
||||
options.c_cflag |= CS8;
|
||||
tcsetattr(fd_, TCSANOW, &options);
|
||||
|
||||
publisher_ = this->create_publisher<std_msgs::msg::Int32>("water_level", 10);
|
||||
|
||||
timer_ = this->create_wall_timer(
|
||||
std::chrono::milliseconds(1000),
|
||||
std::bind(&ArduinoBridge::loop, this));
|
||||
|
||||
RCLCPP_INFO(this->get_logger(), "Arduino Bridge C++ Node Started.");
|
||||
}
|
||||
|
||||
private:
|
||||
const int SERVO_HOME = 0;
|
||||
const int SERVO_STEP = 45;
|
||||
const int SERVO_MAX = 180;
|
||||
const int WATER_THRESHOLD = 10;
|
||||
|
||||
void loop()
|
||||
{
|
||||
int waterL = read_water_level();
|
||||
|
||||
if (waterL >= 0) {
|
||||
auto msg = std_msgs::msg::Int32();
|
||||
msg.data = waterL;
|
||||
publisher_->publish(msg);
|
||||
RCLCPP_INFO(this->get_logger(), "Water Level: %d", waterL);
|
||||
|
||||
// Servo logic: match Arduino sketch
|
||||
if (waterL > WATER_THRESHOLD) {
|
||||
pos_ += SERVO_STEP;
|
||||
if (pos_ >= SERVO_MAX) {
|
||||
pos_ = SERVO_HOME;
|
||||
}
|
||||
} else {
|
||||
pos_ = SERVO_HOME;
|
||||
}
|
||||
|
||||
send_servo_pos(pos_);
|
||||
RCLCPP_INFO(this->get_logger(), "Sent Servo Pos: %d", pos_);
|
||||
}
|
||||
}
|
||||
|
||||
int read_water_level()
|
||||
{
|
||||
char buf[256] = {0};
|
||||
int n = read(fd_, buf, sizeof(buf));
|
||||
if (n > 0) {
|
||||
std::string line(buf, n);
|
||||
size_t pos = line.find("Water Level:");
|
||||
if (pos != std::string::npos) {
|
||||
std::string val_str = line.substr(pos + 12); // length of "Water Level:"
|
||||
int val = std::stoi(val_str);
|
||||
return val;
|
||||
}
|
||||
}
|
||||
return -1;
|
||||
}
|
||||
|
||||
void send_servo_pos(int pos)
|
||||
{
|
||||
std::string cmd = std::to_string(pos) + "\n";
|
||||
write(fd_, cmd.c_str(), cmd.size());
|
||||
}
|
||||
|
||||
std::string device_;
|
||||
int baud_;
|
||||
int fd_;
|
||||
int pos_;
|
||||
|
||||
rclcpp::Publisher<std_msgs::msg::Int32>::SharedPtr publisher_;
|
||||
rclcpp::TimerBase::SharedPtr timer_;
|
||||
};
|
||||
|
||||
int main(int argc, char * argv[])
|
||||
{
|
||||
rclcpp::init(argc, argv);
|
||||
rclcpp::spin(std::make_shared<ArduinoBridge>());
|
||||
rclcpp::shutdown();
|
||||
return 0;
|
||||
}
|
||||
|
||||
1
ros2_ws/src/articubot/articubot_one
Submodule
1
ros2_ws/src/articubot/articubot_one
Submodule
Submodule ros2_ws/src/articubot/articubot_one added at cd1eb0f503
1
ros2_ws/src/articubot/build/.built_by
Normal file
1
ros2_ws/src/articubot/build/.built_by
Normal file
@@ -0,0 +1 @@
|
||||
colcon
|
||||
0
ros2_ws/src/articubot/build/COLCON_IGNORE
Normal file
0
ros2_ws/src/articubot/build/COLCON_IGNORE
Normal file
@@ -0,0 +1,70 @@
|
||||
{
|
||||
"configurations" :
|
||||
[
|
||||
{
|
||||
"directories" :
|
||||
[
|
||||
{
|
||||
"build" : ".",
|
||||
"hasInstallRule" : true,
|
||||
"jsonFile" : "directory-.-040dc5e51163d865c758.json",
|
||||
"minimumCMakeVersion" :
|
||||
{
|
||||
"string" : "3.12"
|
||||
},
|
||||
"projectIndex" : 0,
|
||||
"source" : ".",
|
||||
"targetIndexes" :
|
||||
[
|
||||
0,
|
||||
1
|
||||
]
|
||||
}
|
||||
],
|
||||
"name" : "",
|
||||
"projects" :
|
||||
[
|
||||
{
|
||||
"directoryIndexes" :
|
||||
[
|
||||
0
|
||||
],
|
||||
"name" : "articubot_one",
|
||||
"targetIndexes" :
|
||||
[
|
||||
0,
|
||||
1
|
||||
]
|
||||
}
|
||||
],
|
||||
"targets" :
|
||||
[
|
||||
{
|
||||
"directoryIndex" : 0,
|
||||
"id" : "articubot_one_uninstall::@6890427a1f51a3e7e1df",
|
||||
"jsonFile" : "target-articubot_one_uninstall-1de68365c58460085bb0.json",
|
||||
"name" : "articubot_one_uninstall",
|
||||
"projectIndex" : 0
|
||||
},
|
||||
{
|
||||
"directoryIndex" : 0,
|
||||
"id" : "uninstall::@6890427a1f51a3e7e1df",
|
||||
"jsonFile" : "target-uninstall-7152cb75cba26ff4ee35.json",
|
||||
"name" : "uninstall",
|
||||
"projectIndex" : 0
|
||||
}
|
||||
]
|
||||
}
|
||||
],
|
||||
"kind" : "codemodel",
|
||||
"paths" :
|
||||
{
|
||||
"build" : "/home/rosuser/ros2_ws/src/articubot/build/articubot_one",
|
||||
"source" : "/home/rosuser/ros2_ws/src/articubot/articubot_one"
|
||||
},
|
||||
"version" :
|
||||
{
|
||||
"major" : 2,
|
||||
"minor" : 3
|
||||
}
|
||||
}
|
||||
@@ -0,0 +1,93 @@
|
||||
{
|
||||
"backtraceGraph" :
|
||||
{
|
||||
"commands" :
|
||||
[
|
||||
"_install",
|
||||
"install",
|
||||
"include",
|
||||
"find_package"
|
||||
],
|
||||
"files" :
|
||||
[
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/symlink_install/install.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_symlink_install-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_coreConfig.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmake_export_dependencies-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmakeConfig.cmake",
|
||||
"CMakeLists.txt"
|
||||
],
|
||||
"nodes" :
|
||||
[
|
||||
{
|
||||
"file" : 5
|
||||
},
|
||||
{
|
||||
"command" : 3,
|
||||
"file" : 5,
|
||||
"line" : 19,
|
||||
"parent" : 0
|
||||
},
|
||||
{
|
||||
"file" : 4,
|
||||
"parent" : 1
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 4,
|
||||
"line" : 41,
|
||||
"parent" : 2
|
||||
},
|
||||
{
|
||||
"file" : 3,
|
||||
"parent" : 3
|
||||
},
|
||||
{
|
||||
"command" : 3,
|
||||
"file" : 3,
|
||||
"line" : 15,
|
||||
"parent" : 4
|
||||
},
|
||||
{
|
||||
"file" : 2,
|
||||
"parent" : 5
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 2,
|
||||
"line" : 41,
|
||||
"parent" : 6
|
||||
},
|
||||
{
|
||||
"file" : 1,
|
||||
"parent" : 7
|
||||
},
|
||||
{
|
||||
"command" : 1,
|
||||
"file" : 1,
|
||||
"line" : 47,
|
||||
"parent" : 8
|
||||
},
|
||||
{
|
||||
"command" : 0,
|
||||
"file" : 0,
|
||||
"line" : 43,
|
||||
"parent" : 9
|
||||
}
|
||||
]
|
||||
},
|
||||
"installers" :
|
||||
[
|
||||
{
|
||||
"backtrace" : 10,
|
||||
"component" : "Unspecified",
|
||||
"scriptFile" : "/home/rosuser/ros2_ws/src/articubot/build/articubot_one/ament_cmake_symlink_install/ament_cmake_symlink_install.cmake",
|
||||
"type" : "script"
|
||||
}
|
||||
],
|
||||
"paths" :
|
||||
{
|
||||
"build" : ".",
|
||||
"source" : "."
|
||||
}
|
||||
}
|
||||
@@ -0,0 +1,54 @@
|
||||
{
|
||||
"cmake" :
|
||||
{
|
||||
"generator" :
|
||||
{
|
||||
"multiConfig" : false,
|
||||
"name" : "Unix Makefiles"
|
||||
},
|
||||
"paths" :
|
||||
{
|
||||
"cmake" : "/usr/bin/cmake",
|
||||
"cpack" : "/usr/bin/cpack",
|
||||
"ctest" : "/usr/bin/ctest",
|
||||
"root" : "/usr/share/cmake-3.22"
|
||||
},
|
||||
"version" :
|
||||
{
|
||||
"isDirty" : false,
|
||||
"major" : 3,
|
||||
"minor" : 22,
|
||||
"patch" : 1,
|
||||
"string" : "3.22.1",
|
||||
"suffix" : ""
|
||||
}
|
||||
},
|
||||
"objects" :
|
||||
[
|
||||
{
|
||||
"jsonFile" : "codemodel-v2-0609de17523fb19a8d0c.json",
|
||||
"kind" : "codemodel",
|
||||
"version" :
|
||||
{
|
||||
"major" : 2,
|
||||
"minor" : 3
|
||||
}
|
||||
}
|
||||
],
|
||||
"reply" :
|
||||
{
|
||||
"client-colcon-cmake" :
|
||||
{
|
||||
"codemodel-v2" :
|
||||
{
|
||||
"jsonFile" : "codemodel-v2-0609de17523fb19a8d0c.json",
|
||||
"kind" : "codemodel",
|
||||
"version" :
|
||||
{
|
||||
"major" : 2,
|
||||
"minor" : 3
|
||||
}
|
||||
}
|
||||
}
|
||||
}
|
||||
}
|
||||
@@ -0,0 +1,112 @@
|
||||
{
|
||||
"backtrace" : 9,
|
||||
"backtraceGraph" :
|
||||
{
|
||||
"commands" :
|
||||
[
|
||||
"add_custom_target",
|
||||
"include",
|
||||
"find_package"
|
||||
],
|
||||
"files" :
|
||||
[
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_uninstall_target-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_coreConfig.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmake_export_dependencies-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmakeConfig.cmake",
|
||||
"CMakeLists.txt"
|
||||
],
|
||||
"nodes" :
|
||||
[
|
||||
{
|
||||
"file" : 4
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 4,
|
||||
"line" : 19,
|
||||
"parent" : 0
|
||||
},
|
||||
{
|
||||
"file" : 3,
|
||||
"parent" : 1
|
||||
},
|
||||
{
|
||||
"command" : 1,
|
||||
"file" : 3,
|
||||
"line" : 41,
|
||||
"parent" : 2
|
||||
},
|
||||
{
|
||||
"file" : 2,
|
||||
"parent" : 3
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 2,
|
||||
"line" : 15,
|
||||
"parent" : 4
|
||||
},
|
||||
{
|
||||
"file" : 1,
|
||||
"parent" : 5
|
||||
},
|
||||
{
|
||||
"command" : 1,
|
||||
"file" : 1,
|
||||
"line" : 41,
|
||||
"parent" : 6
|
||||
},
|
||||
{
|
||||
"file" : 0,
|
||||
"parent" : 7
|
||||
},
|
||||
{
|
||||
"command" : 0,
|
||||
"file" : 0,
|
||||
"line" : 40,
|
||||
"parent" : 8
|
||||
}
|
||||
]
|
||||
},
|
||||
"id" : "articubot_one_uninstall::@6890427a1f51a3e7e1df",
|
||||
"name" : "articubot_one_uninstall",
|
||||
"paths" :
|
||||
{
|
||||
"build" : ".",
|
||||
"source" : "."
|
||||
},
|
||||
"sourceGroups" :
|
||||
[
|
||||
{
|
||||
"name" : "",
|
||||
"sourceIndexes" :
|
||||
[
|
||||
0
|
||||
]
|
||||
},
|
||||
{
|
||||
"name" : "CMake Rules",
|
||||
"sourceIndexes" :
|
||||
[
|
||||
1
|
||||
]
|
||||
}
|
||||
],
|
||||
"sources" :
|
||||
[
|
||||
{
|
||||
"backtrace" : 9,
|
||||
"isGenerated" : true,
|
||||
"path" : "/home/rosuser/ros2_ws/src/articubot/build/articubot_one/CMakeFiles/articubot_one_uninstall",
|
||||
"sourceGroupIndex" : 0
|
||||
},
|
||||
{
|
||||
"backtrace" : 0,
|
||||
"isGenerated" : true,
|
||||
"path" : "/home/rosuser/ros2_ws/src/articubot/build/articubot_one/CMakeFiles/articubot_one_uninstall.rule",
|
||||
"sourceGroupIndex" : 1
|
||||
}
|
||||
],
|
||||
"type" : "UTILITY"
|
||||
}
|
||||
@@ -0,0 +1,95 @@
|
||||
{
|
||||
"backtrace" : 9,
|
||||
"backtraceGraph" :
|
||||
{
|
||||
"commands" :
|
||||
[
|
||||
"add_custom_target",
|
||||
"include",
|
||||
"find_package",
|
||||
"add_dependencies"
|
||||
],
|
||||
"files" :
|
||||
[
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_uninstall_target-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake_core/cmake/ament_cmake_coreConfig.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmake_export_dependencies-extras.cmake",
|
||||
"/opt/ros/humble/share/ament_cmake/cmake/ament_cmakeConfig.cmake",
|
||||
"CMakeLists.txt"
|
||||
],
|
||||
"nodes" :
|
||||
[
|
||||
{
|
||||
"file" : 4
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 4,
|
||||
"line" : 19,
|
||||
"parent" : 0
|
||||
},
|
||||
{
|
||||
"file" : 3,
|
||||
"parent" : 1
|
||||
},
|
||||
{
|
||||
"command" : 1,
|
||||
"file" : 3,
|
||||
"line" : 41,
|
||||
"parent" : 2
|
||||
},
|
||||
{
|
||||
"file" : 2,
|
||||
"parent" : 3
|
||||
},
|
||||
{
|
||||
"command" : 2,
|
||||
"file" : 2,
|
||||
"line" : 15,
|
||||
"parent" : 4
|
||||
},
|
||||
{
|
||||
"file" : 1,
|
||||
"parent" : 5
|
||||
},
|
||||
{
|
||||
"command" : 1,
|
||||
"file" : 1,
|
||||
"line" : 41,
|
||||
"parent" : 6
|
||||
},
|
||||
{
|
||||
"file" : 0,
|
||||
"parent" : 7
|
||||
},
|
||||
{
|
||||
"command" : 0,
|
||||
"file" : 0,
|
||||
"line" : 35,
|
||||
"parent" : 8
|
||||
},
|
||||
{
|
||||
"command" : 3,
|
||||
"file" : 0,
|
||||
"line" : 42,
|
||||
"parent" : 8
|
||||
}
|
||||
]
|
||||
},
|
||||
"dependencies" :
|
||||
[
|
||||
{
|
||||
"backtrace" : 10,
|
||||
"id" : "articubot_one_uninstall::@6890427a1f51a3e7e1df"
|
||||
}
|
||||
],
|
||||
"id" : "uninstall::@6890427a1f51a3e7e1df",
|
||||
"name" : "uninstall",
|
||||
"paths" :
|
||||
{
|
||||
"build" : ".",
|
||||
"source" : "."
|
||||
},
|
||||
"sources" : [],
|
||||
"type" : "UTILITY"
|
||||
}
|
||||
502
ros2_ws/src/articubot/build/articubot_one/CMakeCache.txt
Normal file
502
ros2_ws/src/articubot/build/articubot_one/CMakeCache.txt
Normal file
@@ -0,0 +1,502 @@
|
||||
# This is the CMakeCache file.
|
||||
# For build in directory: /home/rosuser/ros2_ws/src/articubot/build/articubot_one
|
||||
# It was generated by CMake: /usr/bin/cmake
|
||||
# You can edit this file to change values found and used by cmake.
|
||||
# If you do not want to change any of the values, simply exit the editor.
|
||||
# If you do want to change a value, simply edit, save, and exit the editor.
|
||||
# The syntax for the file is as follows:
|
||||
# KEY:TYPE=VALUE
|
||||
# KEY is the name of a variable in the cache.
|
||||
# TYPE is a hint to GUIs for the type of VALUE, DO NOT EDIT TYPE!.
|
||||
# VALUE is the current value for the KEY.
|
||||
|
||||
########################
|
||||
# EXTERNAL cache entries
|
||||
########################
|
||||
|
||||
//Generate environment files in the CMAKE_INSTALL_PREFIX
|
||||
AMENT_CMAKE_ENVIRONMENT_GENERATION:BOOL=OFF
|
||||
|
||||
//Generate environment files in the package share folder
|
||||
AMENT_CMAKE_ENVIRONMENT_PACKAGE_GENERATION:BOOL=ON
|
||||
|
||||
//Generate marker file containing the parent prefix path
|
||||
AMENT_CMAKE_ENVIRONMENT_PARENT_PREFIX_PATH_GENERATION:BOOL=ON
|
||||
|
||||
//Replace the CMake install command with a custom implementation
|
||||
// using symlinks instead of copying resources
|
||||
AMENT_CMAKE_SYMLINK_INSTALL:BOOL=1
|
||||
|
||||
//Generate an uninstall target to revert the effects of the install
|
||||
// step
|
||||
AMENT_CMAKE_UNINSTALL_TARGET:BOOL=ON
|
||||
|
||||
//The path where test results are generated
|
||||
AMENT_TEST_RESULTS_DIR:PATH=/home/rosuser/ros2_ws/src/articubot/build/articubot_one/test_results
|
||||
|
||||
//Build the testing tree.
|
||||
BUILD_TESTING:BOOL=ON
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_ADDR2LINE:FILEPATH=/usr/bin/addr2line
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_AR:FILEPATH=/usr/bin/ar
|
||||
|
||||
//Choose the type of build, options are: None Debug Release RelWithDebInfo
|
||||
// MinSizeRel ...
|
||||
CMAKE_BUILD_TYPE:STRING=
|
||||
|
||||
//Enable/Disable color output during build.
|
||||
CMAKE_COLOR_MAKEFILE:BOOL=ON
|
||||
|
||||
//CXX compiler
|
||||
CMAKE_CXX_COMPILER:FILEPATH=/usr/bin/c++
|
||||
|
||||
//A wrapper around 'ar' adding the appropriate '--plugin' option
|
||||
// for the GCC compiler
|
||||
CMAKE_CXX_COMPILER_AR:FILEPATH=/usr/bin/gcc-ar-11
|
||||
|
||||
//A wrapper around 'ranlib' adding the appropriate '--plugin' option
|
||||
// for the GCC compiler
|
||||
CMAKE_CXX_COMPILER_RANLIB:FILEPATH=/usr/bin/gcc-ranlib-11
|
||||
|
||||
//Flags used by the CXX compiler during all build types.
|
||||
CMAKE_CXX_FLAGS:STRING=
|
||||
|
||||
//Flags used by the CXX compiler during DEBUG builds.
|
||||
CMAKE_CXX_FLAGS_DEBUG:STRING=-g
|
||||
|
||||
//Flags used by the CXX compiler during MINSIZEREL builds.
|
||||
CMAKE_CXX_FLAGS_MINSIZEREL:STRING=-Os -DNDEBUG
|
||||
|
||||
//Flags used by the CXX compiler during RELEASE builds.
|
||||
CMAKE_CXX_FLAGS_RELEASE:STRING=-O3 -DNDEBUG
|
||||
|
||||
//Flags used by the CXX compiler during RELWITHDEBINFO builds.
|
||||
CMAKE_CXX_FLAGS_RELWITHDEBINFO:STRING=-O2 -g -DNDEBUG
|
||||
|
||||
//C compiler
|
||||
CMAKE_C_COMPILER:FILEPATH=/usr/bin/cc
|
||||
|
||||
//A wrapper around 'ar' adding the appropriate '--plugin' option
|
||||
// for the GCC compiler
|
||||
CMAKE_C_COMPILER_AR:FILEPATH=/usr/bin/gcc-ar-11
|
||||
|
||||
//A wrapper around 'ranlib' adding the appropriate '--plugin' option
|
||||
// for the GCC compiler
|
||||
CMAKE_C_COMPILER_RANLIB:FILEPATH=/usr/bin/gcc-ranlib-11
|
||||
|
||||
//Flags used by the C compiler during all build types.
|
||||
CMAKE_C_FLAGS:STRING=
|
||||
|
||||
//Flags used by the C compiler during DEBUG builds.
|
||||
CMAKE_C_FLAGS_DEBUG:STRING=-g
|
||||
|
||||
//Flags used by the C compiler during MINSIZEREL builds.
|
||||
CMAKE_C_FLAGS_MINSIZEREL:STRING=-Os -DNDEBUG
|
||||
|
||||
//Flags used by the C compiler during RELEASE builds.
|
||||
CMAKE_C_FLAGS_RELEASE:STRING=-O3 -DNDEBUG
|
||||
|
||||
//Flags used by the C compiler during RELWITHDEBINFO builds.
|
||||
CMAKE_C_FLAGS_RELWITHDEBINFO:STRING=-O2 -g -DNDEBUG
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_DLLTOOL:FILEPATH=CMAKE_DLLTOOL-NOTFOUND
|
||||
|
||||
//Flags used by the linker during all build types.
|
||||
CMAKE_EXE_LINKER_FLAGS:STRING=
|
||||
|
||||
//Flags used by the linker during DEBUG builds.
|
||||
CMAKE_EXE_LINKER_FLAGS_DEBUG:STRING=
|
||||
|
||||
//Flags used by the linker during MINSIZEREL builds.
|
||||
CMAKE_EXE_LINKER_FLAGS_MINSIZEREL:STRING=
|
||||
|
||||
//Flags used by the linker during RELEASE builds.
|
||||
CMAKE_EXE_LINKER_FLAGS_RELEASE:STRING=
|
||||
|
||||
//Flags used by the linker during RELWITHDEBINFO builds.
|
||||
CMAKE_EXE_LINKER_FLAGS_RELWITHDEBINFO:STRING=
|
||||
|
||||
//Enable/Disable output of compile commands during generation.
|
||||
CMAKE_EXPORT_COMPILE_COMMANDS:BOOL=
|
||||
|
||||
//Install path prefix, prepended onto install directories.
|
||||
CMAKE_INSTALL_PREFIX:PATH=/home/rosuser/ros2_ws/src/articubot/install/articubot_one
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_LINKER:FILEPATH=/usr/bin/ld
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_MAKE_PROGRAM:FILEPATH=/usr/bin/gmake
|
||||
|
||||
//Flags used by the linker during the creation of modules during
|
||||
// all build types.
|
||||
CMAKE_MODULE_LINKER_FLAGS:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of modules during
|
||||
// DEBUG builds.
|
||||
CMAKE_MODULE_LINKER_FLAGS_DEBUG:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of modules during
|
||||
// MINSIZEREL builds.
|
||||
CMAKE_MODULE_LINKER_FLAGS_MINSIZEREL:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of modules during
|
||||
// RELEASE builds.
|
||||
CMAKE_MODULE_LINKER_FLAGS_RELEASE:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of modules during
|
||||
// RELWITHDEBINFO builds.
|
||||
CMAKE_MODULE_LINKER_FLAGS_RELWITHDEBINFO:STRING=
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_NM:FILEPATH=/usr/bin/nm
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_OBJCOPY:FILEPATH=/usr/bin/objcopy
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_OBJDUMP:FILEPATH=/usr/bin/objdump
|
||||
|
||||
//Value Computed by CMake
|
||||
CMAKE_PROJECT_DESCRIPTION:STATIC=
|
||||
|
||||
//Value Computed by CMake
|
||||
CMAKE_PROJECT_HOMEPAGE_URL:STATIC=
|
||||
|
||||
//Value Computed by CMake
|
||||
CMAKE_PROJECT_NAME:STATIC=articubot_one
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_RANLIB:FILEPATH=/usr/bin/ranlib
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_READELF:FILEPATH=/usr/bin/readelf
|
||||
|
||||
//Flags used by the linker during the creation of shared libraries
|
||||
// during all build types.
|
||||
CMAKE_SHARED_LINKER_FLAGS:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of shared libraries
|
||||
// during DEBUG builds.
|
||||
CMAKE_SHARED_LINKER_FLAGS_DEBUG:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of shared libraries
|
||||
// during MINSIZEREL builds.
|
||||
CMAKE_SHARED_LINKER_FLAGS_MINSIZEREL:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of shared libraries
|
||||
// during RELEASE builds.
|
||||
CMAKE_SHARED_LINKER_FLAGS_RELEASE:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of shared libraries
|
||||
// during RELWITHDEBINFO builds.
|
||||
CMAKE_SHARED_LINKER_FLAGS_RELWITHDEBINFO:STRING=
|
||||
|
||||
//If set, runtime paths are not added when installing shared libraries,
|
||||
// but are added when building.
|
||||
CMAKE_SKIP_INSTALL_RPATH:BOOL=NO
|
||||
|
||||
//If set, runtime paths are not added when using shared libraries.
|
||||
CMAKE_SKIP_RPATH:BOOL=NO
|
||||
|
||||
//Flags used by the linker during the creation of static libraries
|
||||
// during all build types.
|
||||
CMAKE_STATIC_LINKER_FLAGS:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of static libraries
|
||||
// during DEBUG builds.
|
||||
CMAKE_STATIC_LINKER_FLAGS_DEBUG:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of static libraries
|
||||
// during MINSIZEREL builds.
|
||||
CMAKE_STATIC_LINKER_FLAGS_MINSIZEREL:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of static libraries
|
||||
// during RELEASE builds.
|
||||
CMAKE_STATIC_LINKER_FLAGS_RELEASE:STRING=
|
||||
|
||||
//Flags used by the linker during the creation of static libraries
|
||||
// during RELWITHDEBINFO builds.
|
||||
CMAKE_STATIC_LINKER_FLAGS_RELWITHDEBINFO:STRING=
|
||||
|
||||
//Path to a program.
|
||||
CMAKE_STRIP:FILEPATH=/usr/bin/strip
|
||||
|
||||
//If this value is on, makefiles will be generated without the
|
||||
// .SILENT directive, and all commands will be echoed to the console
|
||||
// during the make. This is useful for debugging only. With Visual
|
||||
// Studio IDE projects all commands are done without /nologo.
|
||||
CMAKE_VERBOSE_MAKEFILE:BOOL=FALSE
|
||||
|
||||
//Path to a program.
|
||||
Python3_EXECUTABLE:FILEPATH=/usr/bin/python3
|
||||
|
||||
//Name of the computer/site where compile is being run
|
||||
SITE:STRING=3ab008f51f92
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake.
|
||||
ament_cmake_DIR:PATH=/opt/ros/humble/share/ament_cmake/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_copyright.
|
||||
ament_cmake_copyright_DIR:PATH=/opt/ros/humble/share/ament_cmake_copyright/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_core.
|
||||
ament_cmake_core_DIR:PATH=/opt/ros/humble/share/ament_cmake_core/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_cppcheck.
|
||||
ament_cmake_cppcheck_DIR:PATH=/opt/ros/humble/share/ament_cmake_cppcheck/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_cpplint.
|
||||
ament_cmake_cpplint_DIR:PATH=/opt/ros/humble/share/ament_cmake_cpplint/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_definitions.
|
||||
ament_cmake_export_definitions_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_definitions/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_dependencies.
|
||||
ament_cmake_export_dependencies_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_dependencies/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_include_directories.
|
||||
ament_cmake_export_include_directories_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_include_directories/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_interfaces.
|
||||
ament_cmake_export_interfaces_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_interfaces/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_libraries.
|
||||
ament_cmake_export_libraries_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_libraries/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_link_flags.
|
||||
ament_cmake_export_link_flags_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_link_flags/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_export_targets.
|
||||
ament_cmake_export_targets_DIR:PATH=/opt/ros/humble/share/ament_cmake_export_targets/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_flake8.
|
||||
ament_cmake_flake8_DIR:PATH=/opt/ros/humble/share/ament_cmake_flake8/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_gen_version_h.
|
||||
ament_cmake_gen_version_h_DIR:PATH=/opt/ros/humble/share/ament_cmake_gen_version_h/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_include_directories.
|
||||
ament_cmake_include_directories_DIR:PATH=/opt/ros/humble/share/ament_cmake_include_directories/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_libraries.
|
||||
ament_cmake_libraries_DIR:PATH=/opt/ros/humble/share/ament_cmake_libraries/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_lint_cmake.
|
||||
ament_cmake_lint_cmake_DIR:PATH=/opt/ros/humble/share/ament_cmake_lint_cmake/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_pep257.
|
||||
ament_cmake_pep257_DIR:PATH=/opt/ros/humble/share/ament_cmake_pep257/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_python.
|
||||
ament_cmake_python_DIR:PATH=/opt/ros/humble/share/ament_cmake_python/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_target_dependencies.
|
||||
ament_cmake_target_dependencies_DIR:PATH=/opt/ros/humble/share/ament_cmake_target_dependencies/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_test.
|
||||
ament_cmake_test_DIR:PATH=/opt/ros/humble/share/ament_cmake_test/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_uncrustify.
|
||||
ament_cmake_uncrustify_DIR:PATH=/opt/ros/humble/share/ament_cmake_uncrustify/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_version.
|
||||
ament_cmake_version_DIR:PATH=/opt/ros/humble/share/ament_cmake_version/cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_cmake_xmllint.
|
||||
ament_cmake_xmllint_DIR:PATH=/opt/ros/humble/share/ament_cmake_xmllint/cmake
|
||||
|
||||
//Path to a program.
|
||||
ament_copyright_BIN:FILEPATH=/opt/ros/humble/bin/ament_copyright
|
||||
|
||||
//Path to a program.
|
||||
ament_flake8_BIN:FILEPATH=/opt/ros/humble/bin/ament_flake8
|
||||
|
||||
//The directory containing a CMake configuration file for ament_lint_auto.
|
||||
ament_lint_auto_DIR:PATH=/opt/ros/humble/share/ament_lint_auto/cmake
|
||||
|
||||
//Path to a program.
|
||||
ament_lint_cmake_BIN:FILEPATH=/opt/ros/humble/bin/ament_lint_cmake
|
||||
|
||||
//The directory containing a CMake configuration file for ament_lint_common.
|
||||
ament_lint_common_DIR:PATH=/opt/ros/humble/share/ament_lint_common/cmake
|
||||
|
||||
//Path to a program.
|
||||
ament_pep257_BIN:FILEPATH=/opt/ros/humble/bin/ament_pep257
|
||||
|
||||
//Path to a program.
|
||||
ament_xmllint_BIN:FILEPATH=/opt/ros/humble/bin/ament_xmllint
|
||||
|
||||
//Value Computed by CMake
|
||||
articubot_one_BINARY_DIR:STATIC=/home/rosuser/ros2_ws/src/articubot/build/articubot_one
|
||||
|
||||
//Value Computed by CMake
|
||||
articubot_one_IS_TOP_LEVEL:STATIC=ON
|
||||
|
||||
//Value Computed by CMake
|
||||
articubot_one_SOURCE_DIR:STATIC=/home/rosuser/ros2_ws/src/articubot/articubot_one
|
||||
|
||||
//Path to a program.
|
||||
xmllint_BIN:FILEPATH=/usr/bin/xmllint
|
||||
|
||||
|
||||
########################
|
||||
# INTERNAL cache entries
|
||||
########################
|
||||
|
||||
//ADVANCED property for variable: CMAKE_ADDR2LINE
|
||||
CMAKE_ADDR2LINE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_AR
|
||||
CMAKE_AR-ADVANCED:INTERNAL=1
|
||||
//This is the directory where this CMakeCache.txt was created
|
||||
CMAKE_CACHEFILE_DIR:INTERNAL=/home/rosuser/ros2_ws/src/articubot/build/articubot_one
|
||||
//Major version of cmake used to create the current loaded cache
|
||||
CMAKE_CACHE_MAJOR_VERSION:INTERNAL=3
|
||||
//Minor version of cmake used to create the current loaded cache
|
||||
CMAKE_CACHE_MINOR_VERSION:INTERNAL=22
|
||||
//Patch version of cmake used to create the current loaded cache
|
||||
CMAKE_CACHE_PATCH_VERSION:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_COLOR_MAKEFILE
|
||||
CMAKE_COLOR_MAKEFILE-ADVANCED:INTERNAL=1
|
||||
//Path to CMake executable.
|
||||
CMAKE_COMMAND:INTERNAL=/usr/bin/cmake
|
||||
//Path to cpack program executable.
|
||||
CMAKE_CPACK_COMMAND:INTERNAL=/usr/bin/cpack
|
||||
//Path to ctest program executable.
|
||||
CMAKE_CTEST_COMMAND:INTERNAL=/usr/bin/ctest
|
||||
//ADVANCED property for variable: CMAKE_CXX_COMPILER
|
||||
CMAKE_CXX_COMPILER-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_COMPILER_AR
|
||||
CMAKE_CXX_COMPILER_AR-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_COMPILER_RANLIB
|
||||
CMAKE_CXX_COMPILER_RANLIB-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_FLAGS
|
||||
CMAKE_CXX_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_FLAGS_DEBUG
|
||||
CMAKE_CXX_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_FLAGS_MINSIZEREL
|
||||
CMAKE_CXX_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_FLAGS_RELEASE
|
||||
CMAKE_CXX_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_CXX_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_CXX_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_COMPILER
|
||||
CMAKE_C_COMPILER-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_COMPILER_AR
|
||||
CMAKE_C_COMPILER_AR-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_COMPILER_RANLIB
|
||||
CMAKE_C_COMPILER_RANLIB-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_FLAGS
|
||||
CMAKE_C_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_FLAGS_DEBUG
|
||||
CMAKE_C_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_FLAGS_MINSIZEREL
|
||||
CMAKE_C_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_FLAGS_RELEASE
|
||||
CMAKE_C_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_C_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_C_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_DLLTOOL
|
||||
CMAKE_DLLTOOL-ADVANCED:INTERNAL=1
|
||||
//Executable file format
|
||||
CMAKE_EXECUTABLE_FORMAT:INTERNAL=ELF
|
||||
//ADVANCED property for variable: CMAKE_EXE_LINKER_FLAGS
|
||||
CMAKE_EXE_LINKER_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_EXE_LINKER_FLAGS_DEBUG
|
||||
CMAKE_EXE_LINKER_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_EXE_LINKER_FLAGS_MINSIZEREL
|
||||
CMAKE_EXE_LINKER_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_EXE_LINKER_FLAGS_RELEASE
|
||||
CMAKE_EXE_LINKER_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_EXE_LINKER_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_EXE_LINKER_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_EXPORT_COMPILE_COMMANDS
|
||||
CMAKE_EXPORT_COMPILE_COMMANDS-ADVANCED:INTERNAL=1
|
||||
//Name of external makefile project generator.
|
||||
CMAKE_EXTRA_GENERATOR:INTERNAL=
|
||||
//Name of generator.
|
||||
CMAKE_GENERATOR:INTERNAL=Unix Makefiles
|
||||
//Generator instance identifier.
|
||||
CMAKE_GENERATOR_INSTANCE:INTERNAL=
|
||||
//Name of generator platform.
|
||||
CMAKE_GENERATOR_PLATFORM:INTERNAL=
|
||||
//Name of generator toolset.
|
||||
CMAKE_GENERATOR_TOOLSET:INTERNAL=
|
||||
//Source directory with the top level CMakeLists.txt file for this
|
||||
// project
|
||||
CMAKE_HOME_DIRECTORY:INTERNAL=/home/rosuser/ros2_ws/src/articubot/articubot_one
|
||||
//Install .so files without execute permission.
|
||||
CMAKE_INSTALL_SO_NO_EXE:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_LINKER
|
||||
CMAKE_LINKER-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MAKE_PROGRAM
|
||||
CMAKE_MAKE_PROGRAM-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MODULE_LINKER_FLAGS
|
||||
CMAKE_MODULE_LINKER_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MODULE_LINKER_FLAGS_DEBUG
|
||||
CMAKE_MODULE_LINKER_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MODULE_LINKER_FLAGS_MINSIZEREL
|
||||
CMAKE_MODULE_LINKER_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MODULE_LINKER_FLAGS_RELEASE
|
||||
CMAKE_MODULE_LINKER_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_MODULE_LINKER_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_MODULE_LINKER_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_NM
|
||||
CMAKE_NM-ADVANCED:INTERNAL=1
|
||||
//number of local generators
|
||||
CMAKE_NUMBER_OF_MAKEFILES:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_OBJCOPY
|
||||
CMAKE_OBJCOPY-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_OBJDUMP
|
||||
CMAKE_OBJDUMP-ADVANCED:INTERNAL=1
|
||||
//Platform information initialized
|
||||
CMAKE_PLATFORM_INFO_INITIALIZED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_RANLIB
|
||||
CMAKE_RANLIB-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_READELF
|
||||
CMAKE_READELF-ADVANCED:INTERNAL=1
|
||||
//Path to CMake installation.
|
||||
CMAKE_ROOT:INTERNAL=/usr/share/cmake-3.22
|
||||
//ADVANCED property for variable: CMAKE_SHARED_LINKER_FLAGS
|
||||
CMAKE_SHARED_LINKER_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SHARED_LINKER_FLAGS_DEBUG
|
||||
CMAKE_SHARED_LINKER_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SHARED_LINKER_FLAGS_MINSIZEREL
|
||||
CMAKE_SHARED_LINKER_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SHARED_LINKER_FLAGS_RELEASE
|
||||
CMAKE_SHARED_LINKER_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SHARED_LINKER_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_SHARED_LINKER_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SKIP_INSTALL_RPATH
|
||||
CMAKE_SKIP_INSTALL_RPATH-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_SKIP_RPATH
|
||||
CMAKE_SKIP_RPATH-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STATIC_LINKER_FLAGS
|
||||
CMAKE_STATIC_LINKER_FLAGS-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STATIC_LINKER_FLAGS_DEBUG
|
||||
CMAKE_STATIC_LINKER_FLAGS_DEBUG-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STATIC_LINKER_FLAGS_MINSIZEREL
|
||||
CMAKE_STATIC_LINKER_FLAGS_MINSIZEREL-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STATIC_LINKER_FLAGS_RELEASE
|
||||
CMAKE_STATIC_LINKER_FLAGS_RELEASE-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STATIC_LINKER_FLAGS_RELWITHDEBINFO
|
||||
CMAKE_STATIC_LINKER_FLAGS_RELWITHDEBINFO-ADVANCED:INTERNAL=1
|
||||
//ADVANCED property for variable: CMAKE_STRIP
|
||||
CMAKE_STRIP-ADVANCED:INTERNAL=1
|
||||
//uname command
|
||||
CMAKE_UNAME:INTERNAL=/usr/bin/uname
|
||||
//ADVANCED property for variable: CMAKE_VERBOSE_MAKEFILE
|
||||
CMAKE_VERBOSE_MAKEFILE-ADVANCED:INTERNAL=1
|
||||
//Details about finding Python3
|
||||
FIND_PACKAGE_MESSAGE_DETAILS_Python3:INTERNAL=[/usr/bin/python3][cfound components: Interpreter ][v3.10.12()]
|
||||
_Python3_EXECUTABLE:INTERNAL=/usr/bin/python3
|
||||
//Python3 Properties
|
||||
_Python3_INTERPRETER_PROPERTIES:INTERNAL=Python;3;10;12;64;;cpython-310-x86_64-linux-gnu;/usr/lib/python3.10;/usr/lib/python3.10;/usr/lib/python3/dist-packages;/usr/lib/python3/dist-packages
|
||||
_Python3_INTERPRETER_SIGNATURE:INTERNAL=0f3e53742e142b1d9e50e4ca5b901dd8
|
||||
//Index for unique symlink install targets
|
||||
__AMENT_CMAKE_SYMLINK_INSTALL_TARGETS_INDEX:INTERNAL=0
|
||||
|
||||
Some files were not shown because too many files have changed in this diff Show More
Reference in New Issue
Block a user