json2msg_helpers.h
Go to the documentation of this file.
1 //
2 // Created by yijiangh on 4/7/18.
3 //
4 
5 #ifndef FRAMEFAB_MPP_JSON2MSG_HELPER_H
6 #define FRAMEFAB_MPP_JSON2MSG_HELPER_H
7 
9 
10 #include <Eigen/Core>
11 
12 // msgs
13 #include <choreo_msgs/Grasp.h>
14 #include <geometry_msgs/Pose.h>
15 
17 {
18 
19 bool isValidJsonGHVector(const rapidjson::Value& j_vector);
20 
21 bool isValidJsonGHPlane(const rapidjson::Value& j_plane);
22 
23 void jsonVectorToEigenVector(const rapidjson::Value& json, Eigen::Vector3d& v);
24 
25 void jsonPlaneToPoseMsg(const rapidjson::Value& json, geometry_msgs::Pose& p);
26 
27 void jsonToGraspFrameFabMsg(const rapidjson::Value& json, choreo_msgs::Grasp& g);
28 
29 }
30 
31 #endif //FRAMEFAB_MPP_JSON2MSG_HELPER_H
bool isValidJsonGHPlane(const rapidjson::Value &j_plane)
void jsonToGraspFrameFabMsg(const rapidjson::Value &json, choreo_msgs::Grasp &g)
void jsonPlaneToPoseMsg(const rapidjson::Value &json, geometry_msgs::Pose &p)
bool isValidJsonGHVector(const rapidjson::Value &j_vector)
void jsonVectorToEigenVector(const rapidjson::Value &json, Eigen::Vector3d &v)


choreo_task_sequence_processor
Author(s): Yijiang Huang
autogenerated on Thu Jul 18 2019 03:59:29