YARP
Yet Another Robot Platform
 
Loading...
Searching...
No Matches
Ros2Utils.h
Go to the documentation of this file.
1/*
2 * SPDX-FileCopyrightText: 2023 Istituto Italiano di Tecnologia (IIT)
3 * SPDX-License-Identifier: BSD-3-Clause
4 */
5
6#ifndef YARP_ROS2_ROS2UTILS_H
7#define YARP_ROS2_ROS2UTILS_H
8
9#include <rclcpp/rclcpp.hpp>
10#include <std_msgs/msg/header.hpp>
11
13{
14public:
15 static rclcpp::Node::SharedPtr createNode(std::string name);
16 static rclcpp::Node::SharedPtr createNode(std::string name, rclcpp::NodeOptions& node_options);
17};
18
19
20builtin_interfaces::msg::Time ros2TimeFromYarp(double yarpTime);
21double yarpTimeFromRos2(builtin_interfaces::msg::Time ros2Time);
22
23#endif // YARP_ROS2_ROS2UTILS_H
builtin_interfaces::msg::Time ros2TimeFromYarp(double yarpTime)
Definition Ros2Utils.cpp:28
double yarpTimeFromRos2(builtin_interfaces::msg::Time ros2Time)
Definition Ros2Utils.cpp:40
static rclcpp::Node::SharedPtr createNode(std::string name)
Definition Ros2Utils.cpp:9