#include "ros/ros.h"#include "std_msgs/String.h"#include <pcl_ros/point_cloud.h>#include <sensor_msgs/PointCloud.h>#include <pcl/point_types.h>#include <boost/foreach.hpp>#include <boost/progress.hpp>#include <geometry_msgs/PoseStamped.h>#include <image_transport/image_transport.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <opencv2/imgproc/imgproc.hpp>#include <opencv2/highgui/highgui.hpp>#include <iostream>#include <fstream>#include "Optimal_affine_tracking_3d16_fast_realtime.h"#include "Optimal_affine_tracking_3d16_fast_realtime_initialize.h"#include "Optimal_affine_tracking_3d16_fast_realtime_terminate.h"#include "rt_nonfinite.h"#include "compute_prob1.h"#include "LoadKinectMesh_realtime.h"#include "init_variables.h"#include <vector>#include <algorithm>
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZRGB > | PointCloud |
Functions | |
| int | main (int argc, char **argv) |
| void | onMouse (int event, int x, int y, int flags, void *data) |
| void | processPointCloud (const PointCloud::ConstPtr &msg) |
Variables | |
| real_T | Aff_matrix [9] |
| static real_T | AR_velocity [2250000] |
| static int | c_x = 0 |
| static int | c_y = 0 |
| real_T | center_x |
| real_T | center_y |
| real_T | centroid [3] |
| cv::Mat | color_img |
| cv::Mat | color_img_roi |
| int32_T | column |
| real_T | corner_p [12] |
| static real_T | dw_dp [15552] |
| double | dxy = 0 |
| ros::Publisher | g_pose_publisher |
| int | i |
| int32_T | i0 |
| int32_T | i1 |
| int32_T | i2 |
| real_T | Ixyz [504063] |
| static real_T | mean_img [3888] |
| int | mosue_click_time = 0 |
| int | mouse_loc_x [4] |
| int | mouse_loc_y [4] |
| real_T | p [12] |
| static real_T | point_matrix [3888] |
| cv::Rect | region_of_interest = cv::Rect(100, 50, 441, 381) |
| int32_T | row |
| int32_T | t |
| static real_T | tracked_images [38880000] |
| static float | v_x = 0 |
| static float | v_y = 0 |
| static real_T | X_par [2250000] |
| static real_T | X_par_pred [2250000] |
| double | xx = 0 |
| double | xx_C = 0 |
| cv::Mat | xyz_img |
| cv::Mat | xyz_img_roi |
| double | yy = 0 |
| double | yy_C = 0 |
| double | zz = 0 |
| double | zz_C = 0 |
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloud |
| void onMouse | ( | int | event, |
| int | x, | ||
| int | y, | ||
| int | flags, | ||
| void * | data | ||
| ) |
| void processPointCloud | ( | const PointCloud::ConstPtr & | msg | ) |
| real_T Aff_matrix[9] |
real_T AR_velocity[2250000] [static] |
| cv::Mat color_img_roi |
| int mosue_click_time = 0 |
| int mouse_loc_x[4] |
| int mouse_loc_y[4] |
real_T point_matrix[3888] [static] |
| cv::Rect region_of_interest = cv::Rect(100, 50, 441, 381) |
real_T tracked_images[38880000] [static] |
real_T X_par_pred[2250000] [static] |
| cv::Mat xyz_img_roi |