#include <geometry_msgs/Point.h>#include <string>#include <vector>#include <ostream>#include <stdint.h>#include <iostream>#include <cmath>#include <stdexcept>#include "duration.h"#include <sys/time.h>#include "serialized_message.h"#include "message_forward.h"#include <ros/time.h>#include <boost/utility/enable_if.hpp>#include <boost/type_traits/remove_const.hpp>#include <boost/type_traits/remove_reference.hpp>#include "message_traits.h"#include "ros/exception.h"#include <boost/array.hpp>#include <boost/call_traits.hpp>#include <boost/mpl/and.hpp>#include <boost/mpl/or.hpp>#include <boost/mpl/not.hpp>#include <cstring>#include "ros/builtin_message_traits.h"#include "ros/macros.h"#include <cstdio>#include <sstream>#include <log4cxx/logger.h>#include <boost/static_assert.hpp>#include <cassert>#include <string.h>#include <boost/shared_ptr.hpp>#include "ros/serialization.h"#include "ros/message_operations.h"#include "ros/message.h"#include "geometry_msgs/Point.h"#include "std_msgs/Header.h"#include "geometry_msgs/Point32.h"#include <stereo_wall_detection/geometry/point.h>#include <stereo_wall_detection/geometry/nearest.h>#include "src/Core/util/DisableMSVCWarnings.h"#include "src/Core/util/Macros.h"#include <cerrno>#include <cstdlib>#include <complex>#include <functional>#include <iosfwd>#include <limits>#include <climits>#include <algorithm>#include "src/Core/util/Constants.h"#include "src/Core/util/ForwardDeclarations.h"#include "src/Core/util/Meta.h"#include "src/Core/util/XprHelper.h"#include "src/Core/util/StaticAssert.h"#include "src/Core/util/Memory.h"#include "src/Core/NumTraits.h"#include "src/Core/MathFunctions.h"#include "src/Core/GenericPacketMath.h"#include "src/Core/arch/Default/Settings.h"#include "src/Core/Functors.h"#include "src/Core/DenseCoeffsBase.h"#include "src/Core/DenseBase.h"#include "src/Core/MatrixBase.h"#include "src/Core/EigenBase.h"#include "src/Core/Assign.h"#include "src/Core/util/BlasUtil.h"#include "src/Core/DenseStorage.h"#include "src/Core/NestByValue.h"#include "src/Core/ForceAlignedAccess.h"#include "src/Core/ReturnByValue.h"#include "src/Core/NoAlias.h"#include "src/Core/PlainObjectBase.h"#include "src/Core/Matrix.h"#include "src/Core/Array.h"#include "src/Core/CwiseBinaryOp.h"#include "src/Core/CwiseUnaryOp.h"#include "src/Core/CwiseNullaryOp.h"#include "src/Core/CwiseUnaryView.h"#include "src/Core/SelfCwiseBinaryOp.h"#include "src/Core/Dot.h"#include "src/Core/StableNorm.h"#include "src/Core/MapBase.h"#include "src/Core/Stride.h"#include "src/Core/Map.h"#include "src/Core/Block.h"#include "src/Core/VectorBlock.h"#include "src/Core/Transpose.h"#include "src/Core/DiagonalMatrix.h"#include "src/Core/Diagonal.h"#include "src/Core/DiagonalProduct.h"#include "src/Core/PermutationMatrix.h"#include "src/Core/Transpositions.h"#include "src/Core/Redux.h"#include "src/Core/Visitor.h"#include "src/Core/Fuzzy.h"#include "src/Core/IO.h"#include "src/Core/Swap.h"#include "src/Core/CommaInitializer.h"#include "src/Core/Flagged.h"#include "src/Core/ProductBase.h"#include "src/Core/Product.h"#include "src/Core/TriangularMatrix.h"#include "src/Core/SelfAdjointView.h"#include "src/Core/SolveTriangular.h"#include "src/Core/products/Parallelizer.h"#include "src/Core/products/CoeffBasedProduct.h"#include "src/Core/products/GeneralBlockPanelKernel.h"#include "src/Core/products/GeneralMatrixVector.h"#include "src/Core/products/GeneralMatrixMatrix.h"#include "src/Core/products/GeneralMatrixMatrixTriangular.h"#include "src/Core/products/SelfadjointMatrixVector.h"#include "src/Core/products/SelfadjointMatrixMatrix.h"#include "src/Core/products/SelfadjointProduct.h"#include "src/Core/products/SelfadjointRank2Update.h"#include "src/Core/products/TriangularMatrixVector.h"#include "src/Core/products/TriangularMatrixMatrix.h"#include "src/Core/products/TriangularSolverMatrix.h"#include "src/Core/products/TriangularSolverVector.h"#include "src/Core/BandMatrix.h"#include "src/Core/BooleanRedux.h"#include "src/Core/Select.h"#include "src/Core/VectorwiseOp.h"#include "src/Core/Random.h"#include "src/Core/Replicate.h"#include "src/Core/Reverse.h"#include "src/Core/ArrayBase.h"#include "src/Core/ArrayWrapper.h"#include "src/Core/GlobalFunctions.h"#include "src/Core/util/EnableMSVCWarnings.h"
Go to the source code of this file.
Namespaces | |
| namespace | cloud_geometry |
| namespace | cloud_geometry::angles |
Functions | |
| void | cloud_geometry::angles::flipNormalTowardsViewpoint (std::vector< double > &normal, const geometry_msgs::Point32 &point, const geometry_msgs::Point32 &viewpoint) |
| Flip (in place) the estimated normal of a point towards a given viewpoint. | |
| void | cloud_geometry::angles::flipNormalTowardsViewpoint (std::vector< double > &normal, const geometry_msgs::Point32 &point, const geometry_msgs::PointStamped &viewpoint) |
| Flip (in place) the estimated normal of a point towards a given viewpoint. | |
| void | cloud_geometry::angles::flipNormalTowardsViewpoint (Eigen::Vector4d &normal, const geometry_msgs::Point32 &point, const geometry_msgs::Point32 &viewpoint) |
| Flip (in place) the estimated normal of a point towards a given viewpoint. | |
| void | cloud_geometry::angles::flipNormalTowardsViewpoint (Eigen::Vector4d &normal, const geometry_msgs::Point32 &point, const geometry_msgs::Point &viewpoint) |
| Flip (in place) the estimated normal of a point towards a given viewpoint. | |
| void | cloud_geometry::angles::flipNormalTowardsViewpoint (Eigen::Vector4d &normal, const geometry_msgs::Point32 &point, const geometry_msgs::PointStamped &viewpoint) |
| Flip (in place) the estimated normal of a point towards a given viewpoint. | |
| double | cloud_geometry::angles::getAngle2D (double x, double y) |
| Compute the angle in the [ 0, 2*PI ) interval of a point (direction) with a reference (0, 0) in 2D. | |
| double | cloud_geometry::angles::getAngle2D (const double point[2]) |
| Compute the angle in the [ 0, 2*PI ) interval of a point (direction) with a reference (0, 0) in 2D. | |
| double | cloud_geometry::angles::getAngle3D (const geometry_msgs::Point &v1, const geometry_msgs::Point32 &v2) |
| Compute the smallest angle between two vectors in the [ 0, PI ) interval in 3D. | |
| double | cloud_geometry::angles::getAngle3D (const geometry_msgs::Point32 &v1, const geometry_msgs::Point &v2) |
| Compute the smallest angle between two vectors in the [ 0, PI ) interval in 3D. | |
| double | cloud_geometry::angles::getAngle3D (const geometry_msgs::Point &v1, const geometry_msgs::Point &v2) |
| Compute the smallest angle between two vectors in the [ 0, PI ) interval in 3D. | |
| double | cloud_geometry::angles::getAngle3D (const geometry_msgs::Point32 &v1, const geometry_msgs::Point32 &v2) |
| Compute the smallest angle between two vectors in the [ 0, PI ) interval in 3D. | |
| double | cloud_geometry::angles::getAngleBetweenPlanes (const std::vector< double > &plane_a, const geometry_msgs::Point32 &plane_b) |
| Get the angle between two planes. | |
| double | cloud_geometry::angles::getAngleBetweenPlanes (const geometry_msgs::Point32 &plane_a, const std::vector< double > &plane_b) |
| Get the angle between two planes. | |
| double | cloud_geometry::angles::getAngleBetweenPlanes (const geometry_msgs::Point32 &plane_a, const geometry_msgs::Point32 &plane_b) |
| Get the angle between two planes. | |
| double | cloud_geometry::angles::getAngleBetweenPlanes (const std::vector< double > &plane_a, const std::vector< double > &plane_b) |
| Get the angle between two planes. | |