#include <cl_nav2z/common.hpp>
#include <tf2/utils.h>
#include <rclcpp/rclcpp.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::Point &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 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 34 of file common.cpp.
   35{
   36  out << "[" << msg.x << " , " << msg.y << " , " << msg.z << "]";
   37  return out;
   38}
 
 
 
◆ operator<<() [3/6]
  
  
      
        
          | std::ostream & operator<<  | 
          ( | 
          std::ostream & |           out,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Pose & |           msg ) | 
         
       
   | 
  
inline   | 
  
 
Definition at line 40 of file common.cpp.
   41{
   42  out << " p " << msg.position;
   43  out << " q [" << msg.orientation.x << " , " << msg.orientation.y << " , " << msg.orientation.z
   44      << ", " << msg.orientation.w << "]";
   45  return out;
   46}
 
 
 
◆ operator<<() [4/6]
  
  
      
        
          | std::ostream & operator<<  | 
          ( | 
          std::ostream & |           out,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::PoseStamped & |           msg ) | 
         
       
   | 
  
inline   | 
  
 
Definition at line 48 of file common.cpp.
   49{
   50  out << msg.pose;
   51  return out;
   52}
 
 
 
◆ operator<<() [5/6]
  
  
      
        
          | std::ostream & operator<<  | 
          ( | 
          std::ostream & |           out,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Quaternion & |           msg ) | 
         
       
   | 
  
inline   | 
  
 
Definition at line 27 of file common.cpp.
   28{
   29  out << " Orientation [" << msg.x << " , " << msg.y << " , " << msg.z << ", " << msg.w
   30      << "] , yaw: " << tf2::getYaw(msg);
   31  return out;
   32}
 
 
 
◆ 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}