SMACC2
Loading...
Searching...
No Matches
common.hpp File Reference
#include <tf2/utils.h>
#include <geometry_msgs/msg/quaternion.hpp>
#include <geometry_msgs/msg/quaternion_stamped.hpp>
#include <moveit_msgs/srv/get_position_ik.hpp>
Include dependency graph for common.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Functions

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 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 moveit_msgs::srv::GetPositionIK::Request &msg)
 
std::ostream & operator<< (std::ostream &out, const sensor_msgs::msg::JointState &)
 

Function Documentation

◆ operator<<() [1/8]

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<<() [2/8]

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<<() [3/8]

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<<() [4/8]

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<<() [5/8]

std::ostream & operator<< ( std::ostream & out,
const geometry_msgs::msg::Transform & msg )
inline

Definition at line 48 of file common.hpp.

49{
50 return out << "Translation[" << msg.translation << "], Rotation[" << msg.rotation << "]";
51}

◆ operator<<() [6/8]

std::ostream & operator<< ( std::ostream & out,
const geometry_msgs::msg::Vector3 & msg )
inline

Definition at line 32 of file common.hpp.

33{
34 return out << "[ " << msg.x << " " << msg.y << " " << msg.z << "]";
35}

◆ operator<<() [7/8]

std::ostream & operator<< ( std::ostream & out,
const moveit_msgs::srv::GetPositionIK::Request & msg )
inline

Definition at line 64 of file common.hpp.

66{
67 return out << "[moveit_msgs::srv::GetPositionIK::Request] position["
68 << msg.ik_request.pose_stamped << "]";
69}

◆ operator<<() [8/8]

std::ostream & operator<< ( std::ostream & out,
const sensor_msgs::msg::JointState & msg )
inline

Definition at line 71 of file common.hpp.

72{
73 return out << "[sensor_msgs::msg::JointState]";
74}