#include <ros/ros.h>#include <sstream>#include <iostream>#include <time.h>#include <stdlib.h>#include <string>#include <sensor_msgs/PointCloud2.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/common/transforms.h>#include <pcl/common/eigen.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| void | rotCallback (const sensor_msgs::PointCloud2ConstPtr &msg) |
Variables | |
| Eigen::Matrix4f | rot_matrix |
| ros::Publisher | rotated_cloud |
| Eigen::Matrix4f | rotMatrixX |
| Eigen::Matrix4f | rotMatrixY |
| Eigen::Matrix4f | rotMatrixZ |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 41 of file pcloud_rot.cpp.
| void rotCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | msg | ) |
Definition at line 28 of file pcloud_rot.cpp.
| Eigen::Matrix4f rot_matrix |
Definition at line 26 of file pcloud_rot.cpp.
Definition at line 22 of file pcloud_rot.cpp.
| Eigen::Matrix4f rotMatrixX |
Definition at line 23 of file pcloud_rot.cpp.
| Eigen::Matrix4f rotMatrixY |
Definition at line 24 of file pcloud_rot.cpp.
| Eigen::Matrix4f rotMatrixZ |
Definition at line 25 of file pcloud_rot.cpp.