Namespaces | Functions
json_conversions_common.h File Reference
#include <ros/ros.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Quaternion.h>
#include <geometry_msgs/Vector3.h>
#include <geometry_msgs/PoseStamped.h>
#include <json/json.hpp>
Include dependency graph for json_conversions_common.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 geometry_msgs
 
 ros
 

Functions

void geometry_msgs::from_json (const nlohmann::json &j, geometry_msgs::Point &r)
 
void geometry_msgs::from_json (const nlohmann::json &j, geometry_msgs::Vector3 &r)
 
void geometry_msgs::from_json (const nlohmann::json &j, geometry_msgs::Quaternion &r)
 
void geometry_msgs::from_json (const nlohmann::json &j, geometry_msgs::Pose &r)
 
void ros::from_json (const nlohmann::json &j, ros::Time &r)
 
void geometry_msgs::to_json (nlohmann::json &j, const geometry_msgs::Point &r)
 
void geometry_msgs::to_json (nlohmann::json &j, const geometry_msgs::Vector3 &r)
 
void geometry_msgs::to_json (nlohmann::json &j, const geometry_msgs::Quaternion &r)
 
void geometry_msgs::to_json (nlohmann::json &j, const geometry_msgs::Pose &r)
 
void ros::to_json (nlohmann::json &j, const ros::Time &r)
 


rc_hand_eye_calibration_client
Author(s): Christian Emmerich
autogenerated on Sat Feb 13 2021 03:41:55