5 #ifndef FRAMEFAB_MPP_JSON2MSG_HELPER_H 6 #define FRAMEFAB_MPP_JSON2MSG_HELPER_H 13 #include <choreo_msgs/Grasp.h> 14 #include <geometry_msgs/Pose.h> 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)