#include <tf2/impl/utils.h>
#include <tf2/utils.h>
#include <moveit2z_client/common.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::Transform &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Pose &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::PoseStamped &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Vector3 &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const geometry_msgs::msg::Point &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const moveit_msgs::srv::GetPositionIK::Request &msg) |
| |
| std::ostream & | operator<< (std::ostream &out, const sensor_msgs::msg::JointState &) |
| |
◆ operator<<() [1/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Point & | msg ) |
|
inline |
Definition at line 52 of file common.cpp.
53{
54 return out << "[ " << msg.x << " " << msg.y << " " << msg.z << "]";
55}
◆ operator<<() [2/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Pose & | msg ) |
|
inline |
Definition at line 36 of file common.cpp.
37{
38 return out << "Position[" << msg.position << "], Orientation[" << msg.orientation << "]";
39}
◆ operator<<() [3/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::PoseStamped & | msg ) |
|
inline |
Definition at line 41 of file common.cpp.
42{
43 return out << "[serialization geometry_msgs::msg::PoseStamped] frame_id: " << msg.header.frame_id
44 << ", pose: " << msg.pose;
45}
◆ operator<<() [4/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Quaternion & | msg ) |
|
inline |
Definition at line 26 of file common.cpp.
27{
28 return out << " Quaternion[" << msg.x << " , " << msg.y << " , " << msg.z << ", w:" << msg.w;
29}
◆ operator<<() [5/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Transform & | msg ) |
|
inline |
Definition at line 31 of file common.cpp.
32{
33 return out << "Translation[" << msg.translation << "], Rotation[" << msg.rotation << "]";
34}
◆ operator<<() [6/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const geometry_msgs::msg::Vector3 & | msg ) |
|
inline |
Definition at line 47 of file common.cpp.
48{
49 return out << "[ " << msg.x << " " << msg.y << " " << msg.z << "]";
50}
◆ operator<<() [7/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const moveit_msgs::srv::GetPositionIK::Request & | msg ) |
|
inline |
Definition at line 57 of file common.cpp.
58{
59 return out << "[moveit_msgs::srv::GetPositionIK::Request] position["
60 << msg.ik_request.pose_stamped << "]";
61}
◆ operator<<() [8/8]
| std::ostream & operator<< |
( |
std::ostream & | out, |
|
|
const sensor_msgs::msg::JointState & | msg ) |
|
inline |
Definition at line 63 of file common.cpp.
64{
65 return out << "[sensor_msgs::msg::JointState]";
66}