Classes | |
struct | quad_less |
Typedefs | |
typedef art_msgs::ArtQuadrilateral | Quad |
shorter type name for ART quadrilateral message | |
Functions | |
bool | compare_backward_seg_lane (const Quad &base, const Quad &comp) |
bool | compare_forward_seg_lane (const Quad &base, const Quad &comp) |
bool | compare_seg_lane (const Quad &base, const Quad &comp) |
art_msgs::ArtLanes | filterAdjacentLanes (MapPose &pose, const art_msgs::ArtLanes &quads, const int lane) |
art_msgs::ArtLanes | filterLanes (const Quad &base_quad, const art_msgs::ArtLanes &quads, bool(*filter)(const Quad &, const Quad &)) |
bool | pointInHull (float x, float y, const geometry_msgs::Point32 *p1, const geometry_msgs::Point32 *p2, const geometry_msgs::Point32 *p3, const geometry_msgs::Point32 *p4) |
bool | quickPointInPoly (float x, float y, const Quad &p) |
bool | quickPointInPolyRatio (float x, float y, const Quad &p, float ratio) |
shorter type name for ART quadrilateral message
Definition at line 30 of file QuadrilateralOps.h.
bool quad_ops::compare_backward_seg_lane | ( | const Quad & | base, |
const Quad & | comp | ||
) | [inline] |
Definition at line 78 of file QuadrilateralOps.h.
bool quad_ops::compare_forward_seg_lane | ( | const Quad & | base, |
const Quad & | comp | ||
) | [inline] |
Definition at line 68 of file QuadrilateralOps.h.
bool quad_ops::compare_seg_lane | ( | const Quad & | base, |
const Quad & | comp | ||
) | [inline] |
Definition at line 59 of file QuadrilateralOps.h.
art_msgs::ArtLanes quad_ops::filterAdjacentLanes | ( | MapPose & | pose, |
const art_msgs::ArtLanes & | quads, | ||
const int | lane | ||
) |
Definition at line 132 of file QuadrilateralOps.cc.
art_msgs::ArtLanes quad_ops::filterLanes | ( | const Quad & | base_quad, |
const art_msgs::ArtLanes & | quads, | ||
bool(*)(const Quad &, const Quad &) | filter | ||
) |
Definition at line 115 of file QuadrilateralOps.cc.
bool quad_ops::pointInHull | ( | float | x, |
float | y, | ||
const geometry_msgs::Point32 * | p1, | ||
const geometry_msgs::Point32 * | p2, | ||
const geometry_msgs::Point32 * | p3, | ||
const geometry_msgs::Point32 * | p4 | ||
) |
Definition at line 8 of file QuadrilateralOps.cc.
bool quad_ops::quickPointInPoly | ( | float | x, |
float | y, | ||
const Quad & | p | ||
) |
Definition at line 26 of file QuadrilateralOps.cc.
bool quad_ops::quickPointInPolyRatio | ( | float | x, |
float | y, | ||
const Quad & | p, | ||
float | ratio | ||
) |
Definition at line 63 of file QuadrilateralOps.cc.