ROS2 3 (Topics (C++))

ROS2のTutorialsをやります。暫くはTutorialsそのままをやります。


Topic通信をC++で実装します。

Writing a simple publisher and subscriber (C++)

環境はUbuntu 22.04です。ROS2 Humbleです。

Topics

Topicsについてはこちらが公式の情報。
Topics vs Services vs Actions

Topics : センサーなどの連続するデータストリームに使われるべき。

Publisherをつくろう !!

workspaceをcreateしてsrcをcreateします。


$ cd ~/ros2_study
$ mkdir topic_cpp_ws
$ cd topic_cpp_ws
$ mkdir src
$ cd src

packageをcreateします。


$ ros2 pkg create publisher_subscriber --build-type ament_cmake
$ cd publisher_subscriber/src
$ ls

publisher_member_function.cpp

公式を見ながらwgetします。
viで確認します。


$ wget https://raw.githubusercontent.com/ros2/examples/humble/rclcpp/topics/minimal_publisher/member_function.cpp
$ mv member_function.cpp publisher_member_function.cpp
$ vi publisher_member_function.cpp

publisher_member_function.cpp

// Copyright 2016 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.

#include <chrono>
#include <functional>
#include <memory>
#include <string>

#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

using namespace std::chrono_literals;

/* This example creates a subclass of Node and uses std::bind() to register a
 * member function as a callback from the timer. */

class MinimalPublisher : public rclcpp::Node
{
public:
  MinimalPublisher()
  : Node("minimal_publisher"), count_(0)
  {
    publisher_ = this->create_publisher<std_msgs::msg::String>("topic", 10);
    timer_ = this->create_wall_timer(
      500ms, std::bind(&MinimalPublisher::timer_callback, this));
  }

private:
  void timer_callback()
  {
    auto message = std_msgs::msg::String();
    message.data = "Hello, world! " + std::to_string(count_++);
    RCLCPP_INFO(this->get_logger(), "Publishing: '%s'", message.data.c_str());
    publisher_->publish(message);
  }
  rclcpp::TimerBase::SharedPtr timer_;
  rclcpp::Publisher<std_msgs::msg::String>::SharedPtr publisher_;
  size_t count_;
};

int main(int argc, char * argv[])
{
  rclcpp::init(argc, argv);
  rclcpp::spin(std::make_shared<MinimalPublisher>());
  rclcpp::shutdown();
  return 0;
}

一番重要なのは下記でしょう。

publisher_->publish(message);

publisher_とtimer_を作って、ここでは500msごとにtimer_にbindした関数が呼び出されて、その中でpublisher_がpublishする、と。

組み込みと同じ考えで設計しろということなんだろうか。CMakeを覚えるだけで大変なので手が回らない。

10はrclcppのnode.hppを読むとQoS(Quality of Service)に関する設定の値とわかる。
rclcppのQoSの調査については後日。

package.xml

公式に従いpackage.xmlを書き換えます。
書き換えたら絶対に保存しろ、みたいなことが書いてあります。


$ cd .. (cd ~/ros2_study/topic_cpp_ws/src/publisher_subscriber)
$ vi package.xml

下記についてfillしろ、と書いてあります。

description tag
maintainer tag / email attribute
license tag

下記のタグを使って依存関係を書け、と書いてあります。(この例はpackage.xmlを書き換えなくても動作します。)

depend tag

<depend>rclcpp</depend>
<depend>std_msgs</depend>

CMakeLists.txt

次はCMakeLists.txtを書き換えます。


$ vi CMakeLists.txt

下記を追加しろ、と公式にあるので追加します。

find_package(rclcpp REQUIRED)
find_package(std_msgs REQUIRED)

次の作業ですが、少し迷います。
ifがあるのでどこに挿入すべきか迷ってしまいます。

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

で、先に下の方を見に行くと完成版が書いてあってifのところが削除されてます。要らないんかい。

完成版をCopyしてしまいましょう。

下記のみ自分の環境に合わせて変更が必要です。

project(publisher_subscriber)

colcon build

Tutorialとして、ここで普通はcolcon buildすると思うのですが、公式は簡単すぎると判断しているのかcolcon buildはSubscriberを作ったあとです。


$ cd ../.. (cd ~/ros2_study/topic_cpp_ws)
$ colcon build --packages-select publisher_subscriber

勿論、公式に従ってcolcon buildを後回しにしても構いません。

Subscriberをつくろう !!


$ cd ~/ros2_study/topic_cpp_ws/src/publisher_subscriber/src

subscriber_member_function.cpp

公式の手順の通りにwgetします。
viで確認します。


$ wget https://raw.githubusercontent.com/ros2/examples/humble/rclcpp/topics/minimal_subscriber/member_function.cpp
$ mv member_function.cpp subscriber_member_function.cpp
$ vi subscriber_member_function.cpp

subscriber_member_function.cpp

// Copyright 2016 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.

#include <functional>
#include <memory>

#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

using std::placeholders::_1;

class MinimalSubscriber : public rclcpp::Node
{
public:
  MinimalSubscriber()
  : Node("minimal_subscriber")
  {
    subscription_ = this->create_subscription<std_msgs::msg::String>(
      "topic", 10, std::bind(&MinimalSubscriber::topic_callback, this, _1));
  }

private:
  void topic_callback(const std_msgs::msg::String & msg) const
  {
    RCLCPP_INFO(this->get_logger(), "I heard: '%s'", msg.data.c_str());
  }
  rclcpp::Subscription<std_msgs::msg::String>::SharedPtr subscription_;
};

int main(int argc, char * argv[])
{
  rclcpp::init(argc, argv);
  rclcpp::spin(std::make_shared<MinimalSubscriber>());
  rclcpp::shutdown();
  return 0;
}

subscriberじゃないんかい。
subscription_のプライベート変数の行の上に一行改行を入れて欲しいと思います。読みにくい。
こちらの10もQoS。

package.xml

Publisher作成の方で対応済み。

CMakeLists.txt

次はCMakeLists.txtを書き換えます。


$ vi CMakeLists.txt

完成版はこちら。

CMakeLists.txt


cmake_minimum_required(VERSION 3.5)
project( publisher_subscriber )

# Default to C++14
if(NOT CMAKE_CXX_STANDARD)
    set(CMAKE_CXX_STANDARD 14)
endif()

if(CMAKE_COMPILER_IS_GNUCXX OR CMAKE_CXX_COMPILER_ID MATCHES "Clang")
    add_compile_options(-Wall -Wextra -Wpedantic)
endif()

find_package(ament_cmake REQUIRED)
find_package(rclcpp REQUIRED)
find_package(std_msgs REQUIRED)

add_executable(talker src/publisher_member_function.cpp)
add_executable(listener src/subscriber_member_function.cpp)

ament_target_dependencies(talker rclcpp std_msgs)
ament_target_dependencies(listener rclcpp std_msgs)

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

ament_package()

build and run

rosdepは不要と思います。
good practiceと書かれているので「colcon buildが通らなかったらrosdepやるということに気付くようになっておけ」ということかもしれません。


$ cd ../.. (cd ~/ros2_study/topic_cpp_ws)
$ colcon build --packages-select publisher_subscriber

talkerを実行します。
ターミナルを立ち上げます。Ctrl-Alt-t。


$ cd ~/ros2_study/topic_cpp_ws
$ . install/setup.bash
$ ros2 run publisher_subscriber talker

listenerを実行します。
別のターミナルを立ち上げます。Ctrl-Alt-t。


$ cd ~/ros2_study/topic_cpp_ws
$ . install/setup.bash
$ ros2 run publisher_subscriber listener

参考

add_executable

Building and installing C++ executables

広告

IT開発関連書とビジネス書が豊富な翔泳社の通販『SEshop』
さくらのレンタルサーバ
ムームードメイン
Oisix(おいしっくす)
らでぃっしゅぼーや
珈琲きゃろっと
エプソムソルト


ROS2 1 (Install ROS2)
ROS2 2 (Workspace, Package)
ROS2 3 (Topics (C++))
ROS2 4 (Creating custom srv file)
ROS2 5 (Services (C++))


«       »