#include <AttributedPoint.h>
Public Member Functions | |
AttributedPoint (std::string type, geometry_msgs::Pose p) | |
AttributedPoint (std::string type, float point_x, float point_y, float point_z, float quaternion_w, float quaternion_x, float quaternion_y, float quaternion_z) | |
Public Attributes | |
std::string | objectType |
geometry_msgs::Pose | pose |
Definition at line 26 of file AttributedPoint.h.
|
inline |
Definition at line 30 of file AttributedPoint.h.
|
inline |
Definition at line 36 of file AttributedPoint.h.
std::string ASR::AttributedPoint::objectType |
Definition at line 27 of file AttributedPoint.h.
geometry_msgs::Pose ASR::AttributedPoint::pose |
Definition at line 28 of file AttributedPoint.h.