#include <ros/ros.h>#include <algorithm>#include <geometry_msgs/PointStamped.h>#include <geometry_msgs/PoseStamped.h>#include <pcl/point_types.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_cloud.h>#include <pcl/kdtree/kdtree_flann.h>#include <pcl/filters/passthrough.h>#include <pcl/surface/mls.h>#include <pcl/filters/conditional_removal.h>#include <tf/transform_listener.h>#include <opencv/cv.h>#include <image_transport/image_transport.h>#include <image_geometry/pinhole_camera_model.h>#include <pcl_ros/transforms.h>#include <pixel_2_3d/Pixel23d.h>Go to the source code of this file.
Classes | |
| class | pixel_2_3d::Pixel23dServer |
Namespaces | |
| namespace | pixel_2_3d |
Defines | |
| #define | DIST3(x1, y1, z1, x2, y2, z2) (std::sqrt((x1-x2)*(x1-x2)+(y1-y2)*(y1-y2)+(z1-z2)*(z1-z2))) |
| #define | SQ(x) ((x) * (x)) |
Typedefs | |
| typedef pcl::PointXYZRGB | PRGB |
Functions | |
| int | main (int argc, char **argv) |
| #define DIST3 | ( | x1, | |
| y1, | |||
| z1, | |||
| x2, | |||
| y2, | |||
| z2 | |||
| ) | (std::sqrt((x1-x2)*(x1-x2)+(y1-y2)*(y1-y2)+(z1-z2)*(z1-z2))) |
Definition at line 22 of file pixel_2_3d.cpp.
| typedef pcl::PointXYZRGB PRGB |
Definition at line 24 of file pixel_2_3d.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 254 of file pixel_2_3d.cpp.