#include <choreo_rapidjson/include/rapidjson/document.h>
#include <Eigen/Core>
#include <choreo_msgs/Grasp.h>
#include <geometry_msgs/Pose.h>
Go to the source code of this file.
Namespaces | |
choreo_task_sequence_processing | |
Functions | |
bool | choreo_task_sequence_processing::isValidJsonGHPlane (const rapidjson::Value &j_plane) |
bool | choreo_task_sequence_processing::isValidJsonGHVector (const rapidjson::Value &j_vector) |
void | choreo_task_sequence_processing::jsonPlaneToPoseMsg (const rapidjson::Value &json, geometry_msgs::Pose &p) |
void | choreo_task_sequence_processing::jsonToGraspFrameFabMsg (const rapidjson::Value &json, choreo_msgs::Grasp &g) |
void | choreo_task_sequence_processing::jsonVectorToEigenVector (const rapidjson::Value &json, Eigen::Vector3d &v) |