#include <iostream>
#include <tf2/transform_datatypes.h>
#include <builtin_interfaces/msg/time.hpp>
#include <geometry_msgs/msg/point.hpp>
#include <geometry_msgs/msg/pose.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <geometry_msgs/msg/quaternion.hpp>
#include <geometry_msgs/msg/quaternion_stamped.hpp>
#include <nav2_msgs/action/navigate_to_pose.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
Go to the source code of this file.
|
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Quaternion &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Pose &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Point &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::PoseStamped &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const nav2_msgs::action::NavigateToPose::Goal &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const builtin_interfaces::msg::Time &msg) |
| |
◆ operator<<() [1/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const builtin_interfaces::msg::Time & | msg ) |
Definition at line 60 of file common.cpp.
61{
62 out << "seconds: " << rclcpp::Time(msg).seconds();
63 return out;
64}
◆ operator<<() [2/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Point & | msg ) |
|
inline |
Definition at line 37 of file common.hpp.
38{
39 return out << "[ " << msg.x << " " << msg.y << " " << msg.z << "]";
40}
◆ operator<<() [3/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Pose & | msg ) |
|
inline |
Definition at line 53 of file common.hpp.
54{
55 return out << "Position[" << msg.position << "], Orientation[" << msg.orientation << "]";
56}
◆ operator<<() [4/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::PoseStamped & | msg ) |
|
inline |
Definition at line 58 of file common.hpp.
59{
60 return out << "[serialization geometry_msgs::msg::PoseStamped] frame_id: " << msg.header.frame_id
61 << ", pose: " << msg.pose;
62}
◆ operator<<() [5/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Quaternion & | msg ) |
|
inline |
Definition at line 42 of file common.hpp.
43{
44 return out << " Quaternion[" << msg.x << " , " << msg.y << " , " << msg.z << ", w:" << msg.w;
45}
◆ operator<<() [6/6]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const nav2_msgs::action::NavigateToPose::Goal & | msg ) |
Definition at line 54 of file common.cpp.
55{
56 out << msg.pose;
57 return out;
58}