Classes | |
| class | SilhouetteMatchClient |
| class | Visualizer |
Functions | |
| void | from_json (const nlohmann::json &j, Instance &r) |
| void | from_json (const nlohmann::json &j, EstimatedPlane &r) |
| void | from_json (const nlohmann::json &j, ObjectToDetect &r) |
| void | from_json (const nlohmann::json &j, DetectObject::Response &r) |
| void | from_json (const nlohmann::json &j, CalibrateBasePlane::Response &r) |
| void | from_json (const nlohmann::json &j, GetBasePlaneCalibration::Response &r) |
| void | from_json (const nlohmann::json &j, DeleteBasePlaneCalibration::Response &r) |
| static std::string | make_tf_prefix (const ros::NodeHandle &nh) |
| void | paramsToCfg (const json ¶ms, SilhouetteMatchConfig &cfg) |
| void | to_json (nlohmann::json &j, const Plane &r) |
| void | to_json (nlohmann::json &j, const ObjectToDetect &r) |
| void | to_json (nlohmann::json &j, const DetectObject::Request &r) |
| void | to_json (nlohmann::json &j, const CalibrateBasePlane::Request &r) |
| void | to_json (nlohmann::json &j, const GetBasePlaneCalibration::Request &r) |
| void | to_json (nlohmann::json &j, const DeleteBasePlaneCalibration::Request &r) |
| geometry_msgs::Transform | toRosTf (const geometry_msgs::Pose &pose) |
|
inline |
Definition at line 62 of file json_conversions.h.
|
inline |
Definition at line 77 of file json_conversions.h.
|
inline |
Definition at line 90 of file json_conversions.h.
|
inline |
Definition at line 104 of file json_conversions.h.
|
inline |
Definition at line 129 of file json_conversions.h.
|
inline |
Definition at line 142 of file json_conversions.h.
|
inline |
Definition at line 153 of file json_conversions.h.
|
static |
Definition at line 39 of file visualizer.cpp.
| void rc_silhouettematch_client::paramsToCfg | ( | const json & | params, |
| SilhouetteMatchConfig & | cfg | ||
| ) |
Definition at line 117 of file rc_silhouettematch_client.cpp.
|
inline |
Definition at line 71 of file json_conversions.h.
|
inline |
Definition at line 84 of file json_conversions.h.
|
inline |
Definition at line 96 of file json_conversions.h.
|
inline |
Definition at line 112 of file json_conversions.h.
|
inline |
Definition at line 136 of file json_conversions.h.
|
inline |
Definition at line 148 of file json_conversions.h.
|
inline |
Definition at line 129 of file visualizer.cpp.