#include <pcl/ModelCoefficients.h>#include <string>#include <vector>#include <ostream>#include "ros/serialization.h"#include "ros/builtin_message_traits.h"#include "ros/message_operations.h"#include "ros/message.h"#include "ros/time.h"#include "std_msgs/Header.h"#include <pcl/common/common.h>

Go to the source code of this file.
Namespaces | |
| namespace | pcl |
Functions | |
| bool | pcl::lineWithLineIntersection (const pcl::ModelCoefficients &line_a, const pcl::ModelCoefficients &line_b, Eigen::Vector4f &point, double sqr_eps=1e-4) |
| Get the intersection of a two 3D lines in space as a 3D point. | |
| bool | pcl::lineWithLineIntersection (const Eigen::VectorXf &line_a, const Eigen::VectorXf &line_b, Eigen::Vector4f &point, double sqr_eps=1e-4) |
| Get the intersection of a two 3D lines in space as a 3D point. | |