2D Point More...
#include <gtsam/base/VectorSpace.h>
#include <gtsam/base/std_optional_serialization.h>
#include <optional>
Go to the source code of this file.
Classes | |
struct | gtsam::Range< A1, A2 > |
struct | gtsam::Range< Point2, Point2 > |
Namespaces | |
gtsam | |
traits | |
Typedefs | |
typedef Vector2 | gtsam::Point2 |
using | gtsam::Point2Pair = std::pair< Point2, Point2 > |
using | gtsam::Point2Pairs = list |
typedef std::vector< Point2, Eigen::aligned_allocator< Point2 > > | gtsam::Point2Vector = list |
Functions | |
std::optional< Point2 > | gtsam::circleCircleIntersection (double R_d, double r_d, double tol) |
list< Point2 > | gtsam::circleCircleIntersection (Point2 c1, double r1, Point2 c2, double r2, double tol=1e-9) |
Intersect 2 circles. More... | |
list< Point2 > | gtsam::circleCircleIntersection (Point2 c1, Point2 c2, std::optional< Point2 > fh) |
double | gtsam::distance2 (const Point2 &p1, const Point2 &q, OptionalJacobian< 1, 2 > H1={}, OptionalJacobian< 1, 2 > H2={}) |
distance between two points More... | |
Point2Pair | gtsam::means (const std::vector< Point2Pair > &abPointPairs) |
Calculate the two means of a set of Point2 pairs. More... | |
double | gtsam::norm2 (const Point2 &p, OptionalJacobian< 1, 2 > H={}) |
Distance of the point from the origin, with Jacobian. More... | |
Point2 | gtsam::operator* (double s, const Point2 &p) |
multiply with scalar More... | |
GTSAM_EXPORT std::ostream & | gtsam::operator<< (std::ostream &os, const gtsam::Point2Pair &p) |
2D Point
Definition in file Point2.h.