ground_region.cpp 24 KB

123456789101112131415161718192021222324252627282930313233343536373839404142434445464748495051525354555657585960616263646566676869707172737475767778798081828384858687888990919293949596979899100101102103104105106107108109110111112113114115116117118119120121122123124125126127128129130131132133134135136137138139140141142143144145146147148149150151152153154155156157158159160161162163164165166167168169170171172173174175176177178179180181182183184185186187188189190191192193194195196197198199200201202203204205206207208209210211212213214215216217218219220221222223224225226227228229230231232233234235236237238239240241242243244245246247248249250251252253254255256257258259260261262263264265266267268269270271272273274275276277278279280281282283284285286287288289290291292293294295296297298299300301302303304305306307308309310311312313314315316317318319320321322323324325326327328329330331332333334335336337338339340341342343344345346347348349350351352353354355356357358359360361362363364365366367368369370371372373374375376377378379380381382383384385386387388389390391392393394395396397398399400401402403404405406407408409410411412413414415416417418419420421422423424425426427428429430431432433434435436437438439440441442443444445446447448449450451452453454455456457458459460461462463464465466467468469470471472473474475476477478479480481482483484485486487488489490491492493494495496497498499500501502503504505506507508509510511512513514515516517518519520521522523524525526527528529530531532533534535536537538539540541542543544545546547548549550551552553554555556557558559560561562563564565566567568569570571572573574575576577578579580581582583584585586587588589590591592593594595596597598599600601602603604605606607608609610611612613614615616617618619620621622623624625626627
  1. //
  2. // Created by zx on 2021/5/20.
  3. //
  4. #include "ground_region.h"
  5. #include <pcl/common/transforms.h>
  6. #include <pcl/filters/statistical_outlier_removal.h>
  7. #include <pcl/filters/voxel_grid.h>
  8. #include <pcl/segmentation/extract_clusters.h>
  9. #include <fcntl.h>
  10. // 测量结果滤波,不影响现有结构
  11. #include "../tool/measure_filter.h"
  12. //欧式聚类*******************************************************
  13. std::vector<pcl::PointCloud<pcl::PointXYZ>::Ptr> Ground_region::segmentation(pcl::PointCloud<pcl::PointXYZ>::Ptr sor_cloud)
  14. {
  15. std::vector<pcl::PointIndices> ece_inlier;
  16. pcl::search::KdTree<pcl::PointXYZ>::Ptr tree(new pcl::search::KdTree<pcl::PointXYZ>);
  17. pcl::EuclideanClusterExtraction<pcl::PointXYZ> ece;
  18. ece.setInputCloud(sor_cloud);
  19. ece.setClusterTolerance(0.07);
  20. ece.setMinClusterSize(20);
  21. ece.setMaxClusterSize(20000);
  22. ece.setSearchMethod(tree);
  23. ece.extract(ece_inlier);
  24. std::vector<pcl::PointCloud<pcl::PointXYZ>::Ptr> segmentation_clouds;
  25. for (int i = 0; i < ece_inlier.size(); i++)
  26. {
  27. pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_copy(new pcl::PointCloud<pcl::PointXYZ>);
  28. std::vector<int> ece_inlier_ext = ece_inlier[i].indices;
  29. copyPointCloud(*sor_cloud, ece_inlier_ext, *cloud_copy); //按照索引提取点云数据
  30. segmentation_clouds.push_back(cloud_copy);
  31. }
  32. return segmentation_clouds;
  33. }
  34. /**
  35. * @description: distance between two points
  36. * @param {Point2f} p1
  37. * @param {Point2f} p2
  38. * @return the distance
  39. */
  40. double Ground_region::distance(cv::Point2f p1, cv::Point2f p2)
  41. {
  42. return sqrt(pow(p1.x - p2.x, 2.0) + pow(p1.y - p2.y, 2.0));
  43. }
  44. /**
  45. * @description: point rectangle detect
  46. * @param points detect if points obey the rectangle rule
  47. * @return wether forms a rectangle
  48. */
  49. bool Ground_region::isRect(std::vector<cv::Point2f> &points)
  50. {
  51. if (points.size() == 4)
  52. {
  53. double L[3] = {0.0};
  54. L[0] = distance(points[0], points[1]);
  55. L[1] = distance(points[1], points[2]);
  56. L[2] = distance(points[0], points[2]);
  57. double max_l = L[0];
  58. double l1 = L[1];
  59. double l2 = L[2];
  60. cv::Point2f ps = points[0], pt = points[1];
  61. cv::Point2f pc = points[2];
  62. for (int i = 1; i < 3; ++i)
  63. {
  64. if (L[i] > max_l)
  65. {
  66. max_l = L[i];
  67. l1 = L[abs(i + 1) % 3];
  68. l2 = L[abs(i + 2) % 3];
  69. ps = points[i % 3];
  70. pt = points[(i + 1) % 3];
  71. pc = points[(i + 2) % 3];
  72. }
  73. }
  74. //直角边与坐标轴的夹角 <20°
  75. float thresh = 20.0 * M_PI / 180.0;
  76. cv::Point2f vct(pt.x - pc.x, pt.y - pc.y);
  77. float angle = atan2(vct.y, vct.x);
  78. if (!(fabs(angle) < thresh || (M_PI_2 - fabs(angle) < thresh)))
  79. {
  80. //std::cout<<" 4 wheel axis angle : "<<angle<<std::endl;
  81. return false;
  82. }
  83. double cosa = (l1 * l1 + l2 * l2 - max_l * max_l) / (2.0 * l1 * l2);
  84. if (fabs(cosa) >= 0.15)
  85. {
  86. /*char description[255]={0};
  87. sprintf(description,"angle cos value(%.2f) >0.13 ",cosa);
  88. std::cout<<description<<std::endl;*/
  89. return false;
  90. }
  91. float width = std::min(l1, l2);
  92. float length = std::max(l1, l2);
  93. if (width < 1.400 || width > 1.900 || length > 3.300 || length < 2.200)
  94. {
  95. /*char description[255]={0};
  96. sprintf(description,"width<1400 || width >1900 || length >3300 ||length < 2200 l:%.1f,w:%.1f",length,width);
  97. std::cout<<description<<std::endl;*/
  98. return false;
  99. }
  100. double d = distance(pc, points[3]);
  101. cv::Point2f center1 = (ps + pt) * 0.5;
  102. cv::Point2f center2 = (pc + points[3]) * 0.5;
  103. if (fabs(d - max_l) > max_l * 0.1 || distance(center1, center2) > 0.150)
  104. {
  105. /*std::cout << "d:" << d << " maxl:" << max_l << " center1:" << center1 << " center2:" << center2<<std::endl;
  106. char description[255]={0};
  107. sprintf(description,"Verify failed-4 fabs(d - max_l) > max_l * 0.1 || distance(center1, center2) > 0.150 ");
  108. std::cout<<description<<std::endl;*/
  109. return false;
  110. }
  111. //std::cout << "d:" << d << " maxl:" << max_l << " center1:" << center1 << " center2:" << center2<<std::endl;
  112. return true;
  113. }
  114. else if (points.size() == 3)
  115. {
  116. double L[3] = {0.0};
  117. L[0] = distance(points[0], points[1]);
  118. L[1] = distance(points[1], points[2]);
  119. L[2] = distance(points[0], points[2]);
  120. double max_l = L[0];
  121. double l1 = L[1];
  122. double l2 = L[2];
  123. int max_index = 0;
  124. cv::Point2f ps = points[0], pt = points[1];
  125. cv::Point2f pc = points[2];
  126. for (int i = 1; i < 3; ++i)
  127. {
  128. if (L[i] > max_l)
  129. {
  130. max_index = i;
  131. max_l = L[i];
  132. l1 = L[abs(i + 1) % 3];
  133. l2 = L[abs(i + 2) % 3];
  134. ps = points[i % 3];
  135. pt = points[(i + 1) % 3];
  136. pc = points[(i + 2) % 3];
  137. }
  138. }
  139. //直角边与坐标轴的夹角 <20°
  140. float thresh = 20.0 * M_PI / 180.0;
  141. cv::Point2f vct(pt.x - pc.x, pt.y - pc.y);
  142. float angle = atan2(vct.y, vct.x);
  143. if (!(fabs(angle) < thresh || (M_PI_2 - fabs(angle) < thresh)))
  144. {
  145. //std::cout<<" 4 wheel axis angle : "<<angle<<std::endl;
  146. return false;
  147. }
  148. double cosa = (l1 * l1 + l2 * l2 - max_l * max_l) / (2.0 * l1 * l2);
  149. if (fabs(cosa) >= 0.15)
  150. {
  151. /*char description[255]={0};
  152. sprintf(description,"3 wheels angle cos value(%.2f) >0.13 ",cosa);
  153. std::cout<<description<<std::endl;*/
  154. return false;
  155. }
  156. double l = std::max(l1, l2);
  157. double w = std::min(l1, l2);
  158. if (l > 2.100 && l < 3.300 && w > 1.400 && w < 2.100)
  159. {
  160. //生成第四个点
  161. cv::Point2f vec1 = ps - pc;
  162. cv::Point2f vec2 = pt - pc;
  163. cv::Point2f point4 = (vec1 + vec2) + pc;
  164. points.push_back(point4);
  165. /*char description[255]={0};
  166. sprintf(description,"3 wheels rectangle cos angle=%.2f,L=%.1f, w=%.1f",cosa,l,w);
  167. std::cout<<description<<std::endl;*/
  168. return true;
  169. }
  170. else
  171. {
  172. /*char description[255]={0};
  173. sprintf(description,"3 wheels rectangle verify Failed cos angle=%.2f,L=%.1f, w=%.1f",cosa,l,w);
  174. std::cout<<description<<std::endl;*/
  175. return false;
  176. }
  177. }
  178. //std::cout<<" default false"<<std::endl;
  179. return false;
  180. }
  181. /**
  182. * @description: 3d wheel detect core func
  183. * @param cloud input cloud for measure
  184. * @param thresh_z z value to cut wheel
  185. * @param result detect result
  186. * @return wether successfully detected
  187. */
  188. bool Ground_region::classify_ceres_detect(pcl::PointCloud<pcl::PointXYZ>::Ptr cloud, double thresh_z,
  189. detect_wheel_ceres3d::Detect_result &result)
  190. {
  191. if (m_detector == nullptr)
  192. return false;
  193. pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_filtered(new pcl::PointCloud<pcl::PointXYZ>);
  194. for (int i = 0; i < cloud->size(); ++i)
  195. {
  196. pcl::PointXYZ pt = cloud->points[i];
  197. if (pt.z < thresh_z)
  198. {
  199. cloud_filtered->push_back(pt);
  200. }
  201. }
  202. //下采样
  203. pcl::VoxelGrid<pcl::PointXYZ> vox; //创建滤波对象
  204. vox.setInputCloud(cloud_filtered); //设置需要过滤的点云给滤波对象
  205. vox.setLeafSize(0.02f, 0.02f, 0.02f); //设置滤波时创建的体素体积为1cm的立方体
  206. vox.filter(*cloud_filtered); //执行滤波处理,存储输出
  207. if (cloud_filtered->size() == 0)
  208. {
  209. return false;
  210. }
  211. if (cloud_filtered->size() == 0)
  212. return false;
  213. pcl::StatisticalOutlierRemoval<pcl::PointXYZ> sor; //创建滤波器对象
  214. sor.setInputCloud(cloud_filtered); //设置待滤波的点云
  215. sor.setMeanK(5); //设置在进行统计时考虑的临近点个数
  216. sor.setStddevMulThresh(3.0); //设置判断是否为离群点的阀值,用来倍乘标准差,也就是上面的std_mul
  217. sor.filter(*cloud_filtered); //滤波结果存储到cloud_filtered
  218. if (cloud_filtered->size() == 0)
  219. {
  220. return false;
  221. }
  222. std::vector<pcl::PointCloud<pcl::PointXYZ>::Ptr> seg_clouds;
  223. seg_clouds = segmentation(cloud_filtered);
  224. if (!(seg_clouds.size() == 4 || seg_clouds.size() == 3))
  225. {
  226. return false;
  227. }
  228. std::vector<cv::Point2f> centers;
  229. for (int i = 0; i < seg_clouds.size(); ++i)
  230. {
  231. Eigen::Vector4f centroid;
  232. pcl::compute3DCentroid(*seg_clouds[i], centroid);
  233. centers.push_back(cv::Point2f(centroid[0], centroid[1]));
  234. }
  235. bool ret = isRect(centers);
  236. if (ret)
  237. {
  238. std::string error_str;
  239. if (m_detector->detect(seg_clouds, result, error_str))
  240. {
  241. return true;
  242. }
  243. else
  244. {
  245. // LOG(WARNING) << error_str;
  246. return false;
  247. }
  248. }
  249. return ret;
  250. }
  251. // constructor
  252. Ground_region::Ground_region()
  253. {
  254. m_region_status = E_UNKNOWN;
  255. m_detector = nullptr;
  256. m_measure_thread = nullptr;
  257. }
  258. // deconstructor
  259. Ground_region::~Ground_region()
  260. {
  261. if(m_measure_thread){
  262. m_measure_condition.kill_all();
  263. // Close Capturte Thread
  264. if (m_measure_thread->joinable())
  265. {
  266. m_measure_thread->join();
  267. delete m_measure_thread;
  268. m_measure_thread = nullptr;
  269. }
  270. }
  271. }
  272. Error_manager Ground_region::init(velodyne::Region region, pcl::PointCloud<pcl::PointXYZ>::Ptr left_model, pcl::PointCloud<pcl::PointXYZ>::Ptr right_model)
  273. {
  274. m_region = region;
  275. m_detector = new detect_wheel_ceres3d(left_model,right_model);
  276. mp_cloud_collection = pcl::PointCloud<pcl::PointXYZ>::Ptr(new pcl::PointCloud<pcl::PointXYZ>);
  277. mp_cloud_filtered = pcl::PointCloud<pcl::PointXYZ>::Ptr(new pcl::PointCloud<pcl::PointXYZ>);
  278. mp_cloud_detect_z = pcl::PointCloud<pcl::PointXYZ>::Ptr(new pcl::PointCloud<pcl::PointXYZ>);
  279. m_measure_thread = new std::thread(&Ground_region::thread_measure_func, this);
  280. m_measure_condition.reset();
  281. m_region_status = E_READY;
  282. return SUCCESS;
  283. }
  284. // 计算均方误差
  285. bool computer_var(std::vector<double> data, double &var)
  286. {
  287. if (data.size() == 0)
  288. return false;
  289. Eigen::VectorXd dis_vec(data.size());
  290. for (int i = 0; i < data.size(); ++i)
  291. {
  292. dis_vec[i] = data[i];
  293. }
  294. double mean = dis_vec.mean();
  295. Eigen::VectorXd mean_vec(data.size());
  296. Eigen::VectorXd mat = dis_vec - (mean_vec.setOnes() * mean);
  297. Eigen::MatrixXd result = (mat.transpose()) * mat;
  298. var = sqrt(result(0) / double(data.size()));
  299. return true;
  300. }
  301. Error_manager Ground_region::detect(pcl::PointCloud<pcl::PointXYZ>::Ptr cloud, detect_wheel_ceres3d::Detect_result &last_result)
  302. {
  303. if (cloud->size() == 0)
  304. return Error_manager(VELODYNE_REGION_EMPTY_CLOUD, NORMAL, "no point");
  305. std::chrono::steady_clock::time_point t1 = std::chrono::steady_clock::now();
  306. pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_filtered(new pcl::PointCloud<pcl::PointXYZ>);
  307. for (int i = 0; i < cloud->size(); ++i)
  308. {
  309. pcl::PointXYZ pt = cloud->points[i];
  310. if (pt.x > m_region.minx() && pt.x < m_region.maxx() && pt.y > m_region.miny() && pt.y < m_region.maxy() && pt.z > m_region.minz() && pt.z < m_region.maxz())
  311. {
  312. cloud_filtered->push_back(pt);
  313. }
  314. }
  315. //离群点过滤
  316. pcl::StatisticalOutlierRemoval<pcl::PointXYZ> sor;
  317. sor.setInputCloud(cloud_filtered);
  318. sor.setMeanK(15); //K近邻搜索点个数
  319. sor.setStddevMulThresh(3.0); //标准差倍数
  320. sor.setNegative(false); //保留未滤波点(内点)
  321. sor.filter(*cloud_filtered); //保存滤波结果到cloud_filter
  322. //下采样
  323. pcl::ApproximateVoxelGrid<pcl::PointXYZ> vox; //创建滤波对象
  324. vox.setInputCloud(cloud_filtered); //设置需要过滤的点云给滤波对象
  325. vox.setLeafSize(0.02f, 0.02f, 0.02f); //设置滤波时创建的体素体积为1cm的立方体
  326. vox.filter(*cloud_filtered); //执行滤波处理,存储输出
  327. if (cloud_filtered->size() == 0)
  328. return Error_manager(VELODYNE_REGION_EMPTY_CLOUD, NORMAL, "filtered no point");
  329. // 更新过滤点
  330. m_filtered_cloud_mutex.lock();
  331. mp_cloud_filtered->clear();
  332. mp_cloud_filtered->operator+=(*cloud_filtered);
  333. m_filtered_cloud_mutex.unlock();
  334. // z detect
  335. pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_detect_z(new pcl::PointCloud<pcl::PointXYZ>);
  336. double x, y, theta, width, z_value=0.2;
  337. if(!Car_pose_detector::get_instance_references().detect_pose(cloud_filtered, cloud_detect_z, x, y, theta, width, z_value, false))
  338. {
  339. return Error_manager(VELODYNE_REGION_CERES_SOLVE_ERROR, NEGLIGIBLE_ERROR, "find chassis z value failed.");
  340. }
  341. std::chrono::steady_clock::time_point t2 = std::chrono::steady_clock::now();
  342. std::chrono::duration<double> time_used_bowl = std::chrono::duration_cast<std::chrono::duration<double>>(t2 - t1);
  343. // ***************** 测试xoz优化底盘检测算法 *****************
  344. chassis_ceres_solver t_solver;
  345. pcl::PointCloud<pcl::PointXYZ>::Ptr cloud_z_solver(new pcl::PointCloud<pcl::PointXYZ>);
  346. for (int i = 0; i < cloud->size(); ++i)
  347. {
  348. pcl::PointXYZ pt = cloud->points[i];
  349. if (pt.x > m_region.minx() && pt.x < m_region.maxx() && pt.y > m_region.miny() && pt.y < m_region.maxy())
  350. {
  351. cloud_z_solver->push_back(pt);
  352. }
  353. }
  354. double mid_z = 0.05, height = 0.08;
  355. Car_pose_detector::get_instance_references().inv_trans_cloud(cloud_z_solver, x, y, theta);
  356. // //下采样
  357. // vox.setInputCloud(cloud_z_solver); //设置需要过滤的点云给滤波对象
  358. // vox.setLeafSize(0.02f, 0.02f, 0.02f); //设置滤波时创建的体素体积为1cm的立方体
  359. // vox.filter(*cloud_z_solver); //执行滤波处理,存储输出
  360. x = 0.0;
  361. width = 1.0;
  362. // Error_manager ec = t_solver.solve(cloud_z_solver, x, mid_z, width, height);
  363. Error_manager ec = t_solver.solve_mat(cloud_z_solver, x, mid_z, width, height, false);
  364. // 切除大于height高度以外点,并显示width直线
  365. // 根据z值切原始点云
  366. pcl::PassThrough<pcl::PointXYZ> pass;
  367. pass.setInputCloud(cloud_z_solver);
  368. pass.setFilterFieldName("z");
  369. pass.setFilterLimits(m_region.minz(), mid_z + height / 2.0);
  370. pass.setFilterLimitsNegative(false);
  371. pass.filter(*cloud_z_solver);
  372. for (double i = -3.0; i < 3.0; i+=0.02)
  373. {
  374. cloud_z_solver->push_back(pcl::PointXYZ(-width/2.0, i, 0));
  375. cloud_z_solver->push_back(pcl::PointXYZ(width/2.0, i, 0));
  376. }
  377. // std::cout << "\n------------------------------------ chassis z1: " << mid_z + height / 2.0 << std::endl;
  378. std::chrono::steady_clock::time_point t3 = std::chrono::steady_clock::now();
  379. std::chrono::duration<double> time_used_block = std::chrono::duration_cast<std::chrono::duration<double>>(t3 - t2);
  380. // 更新z中间点
  381. m_detect_z_cloud_mutex.lock();
  382. mp_cloud_detect_z->clear();
  383. mp_cloud_detect_z->operator+=(*cloud_z_solver);
  384. m_detect_z_cloud_mutex.unlock();
  385. // 二分法存在错误,直接使用底盘z值
  386. std::vector<detect_wheel_ceres3d::Detect_result> results;
  387. detect_wheel_ceres3d::Detect_result result;
  388. double chassis_z = mid_z + height / 2.0; // + 0.02;
  389. if(chassis_z > m_region.maxz() || chassis_z < m_region.minz())
  390. {
  391. return Error_manager(VELODYNE_REGION_CERES_SOLVE_ERROR, NEGLIGIBLE_ERROR, (std::string("failed to find chassis z value: ")+std::to_string(chassis_z)).c_str());
  392. }
  393. bool ret = false;
  394. while(chassis_z > mid_z)
  395. {
  396. ret = classify_ceres_detect(cloud_filtered, chassis_z, result);
  397. // changed by yct, 暂时直接识别,调试用,之后将条件恢复
  398. if(ret)
  399. {
  400. results.push_back(result);
  401. break;
  402. }else{
  403. chassis_z -= 0.01;
  404. }
  405. }
  406. // float start_z = m_region.minz();
  407. // float max_z = z_value;//0.2;
  408. // float center_z = (start_z + max_z) / 2.0;
  409. // float last_center_z = start_z;
  410. // float last_succ_z = -1.0;
  411. // int count = 0;
  412. // //二分法 找识别成功的 最高的z
  413. // std::vector<detect_wheel_ceres3d::Detect_result> results;
  414. // do
  415. // {
  416. // detect_wheel_ceres3d::Detect_result result;
  417. // bool ret = classify_ceres_detect(cloud_filtered, center_z, result);
  418. // // std::cout << "z: " << center_z <<", "<<start_z<<"," << max_z <<(ret?"clustered":"clustering failed")<< std::endl;
  419. // if (ret)
  420. // {
  421. // results.push_back(result);
  422. // last_succ_z = center_z;
  423. // start_z = center_z;
  424. // last_center_z = center_z;
  425. // }
  426. // else
  427. // {
  428. // max_z = center_z;
  429. // last_center_z = center_z;
  430. // }
  431. // center_z = (start_z + max_z) / 2.0;
  432. // count++;
  433. // } while (fabs(center_z - last_center_z) > 0.01);
  434. std::chrono::steady_clock::time_point t4 = std::chrono::steady_clock::now();
  435. std::chrono::duration<double> time_used_div = std::chrono::duration_cast<std::chrono::duration<double>>(t4 - t3);
  436. // std::cout << "\n------------------------------------------------------------ " << std::to_string(time_used_bowl.count()) << " " << std::to_string(time_used_block.count()) << " " << std::to_string(time_used_div.count()) << std::endl;
  437. if (results.size() == 0)
  438. {
  439. std::cout << "\n-------- no result: " << std::endl;
  440. return Error_manager(FAILED, NORMAL, "no car detected");
  441. }
  442. /// to be
  443. float min_mean_loss = 1.0;
  444. for (int i = 0; i < results.size(); ++i)
  445. {
  446. detect_wheel_ceres3d::Detect_result result = results[i];
  447. std::vector<double> loss;
  448. loss.push_back(result.loss.lf_loss);
  449. loss.push_back(result.loss.rf_loss);
  450. loss.push_back(result.loss.lb_loss);
  451. loss.push_back(result.loss.rb_loss);
  452. double mean = (result.loss.lf_loss + result.loss.rf_loss + result.loss.lb_loss + result.loss.rb_loss) / 4.0;
  453. double var = -1.;
  454. computer_var(loss, var);
  455. if (mean < min_mean_loss)
  456. {
  457. last_result = result;
  458. min_mean_loss = mean;
  459. }
  460. }
  461. // printf("z : %.3f angle : %.3f front : %.3f wheel_base:%.3f,width:%.3f, mean:%.5f\n",
  462. // center_z, last_result.theta, last_result.front_theta, last_result.wheel_base, last_result.width,
  463. // min_mean_loss);
  464. // std::cout << "\n-------- final z: " << chassis_z << std::endl;
  465. // std::cout << "cx: " << last_result.cx << ", cy: " << last_result.cy << ", theta: " << last_result.theta
  466. // << ", front: " << last_result.front_theta << ", wheelbase: " << last_result.wheel_base << ", width: " << last_result.width << std::endl;
  467. // last_result.cx -= x;
  468. // last_result.cy -= y;
  469. // last_result.theta -= theta;
  470. // // changed by yct, save 3d wheel detect result.
  471. // m_detector->save_debug_data("/home/youchen/extra_space/chutian/measure/chutian_velo_ws/log/debug");
  472. return SUCCESS;
  473. }
  474. //外部调用获取当前车轮定位信息, 获取指令时间之后的车轮定位信息, 如果没有就会报错, 不会等待
  475. Error_manager Ground_region::get_current_wheel_information(Common_data::Car_wheel_information *p_car_wheel_information, std::chrono::system_clock::time_point command_time)
  476. {
  477. if ( p_car_wheel_information == NULL )
  478. {
  479. return Error_manager(Error_code::POINTER_IS_NULL, Error_level::MINOR_ERROR,
  480. " POINTER IS NULL ");
  481. }
  482. //获取指令时间之后的信息, 如果没有就会报错, 不会等待
  483. if( m_detect_update_time > command_time )
  484. {
  485. *p_car_wheel_information = m_car_wheel_information;
  486. if(m_car_wheel_information.correctness)
  487. return Error_code::SUCCESS;
  488. else
  489. return Error_manager(Error_code::VELODYNE_REGION_CERES_SOLVE_ERROR, Error_level::MINOR_ERROR, " Ground_region detect error");
  490. }
  491. else
  492. {
  493. return Error_manager(Error_code::VELODYNE_REGION_EMPTY_NO_WHEEL_INFORMATION, Error_level::MINOR_ERROR,
  494. " Ground_region::get_current_wheel_information error ");
  495. }
  496. }
  497. //外部调用获取最新的车轮定位信息, 获取指令时间往前一个周期内的车轮定位信息, 如果没有就会报错, 不会等待
  498. Error_manager Ground_region::get_last_wheel_information(Common_data::Car_wheel_information *p_car_wheel_information, std::chrono::system_clock::time_point command_time)
  499. {
  500. if ( p_car_wheel_information == NULL )
  501. {
  502. return Error_manager(Error_code::POINTER_IS_NULL, Error_level::MINOR_ERROR,
  503. " POINTER IS NULL ");
  504. }
  505. //获取指令时间之后的信息, 如果没有就会报错, 不会等待
  506. // LOG(WARNING) << std::chrono::duration_cast<std::chrono::milliseconds>(command_time-m_detect_update_time).count()/1000.0 <<", "
  507. // <<std::chrono::duration_cast<std::chrono::milliseconds>(command_time-m_cloud_collection_time).count()/1000.0;
  508. if( m_detect_update_time > command_time - std::chrono::milliseconds(GROUND_REGION_DETECT_CYCLE_MS))
  509. {
  510. *p_car_wheel_information = m_car_wheel_information;
  511. if(m_car_wheel_information.correctness)
  512. return Error_code::SUCCESS;
  513. else
  514. return Error_manager(Error_code::VELODYNE_REGION_CERES_SOLVE_ERROR, Error_level::MINOR_ERROR, " Ground_region detect error");
  515. }
  516. else
  517. {
  518. return Error_manager(Error_code::VELODYNE_REGION_EMPTY_NO_WHEEL_INFORMATION, Error_level::MINOR_ERROR,
  519. " Ground_region::get_current_wheel_information error ");
  520. }
  521. }
  522. Error_manager Ground_region::update_cloud(pcl::PointCloud<pcl::PointXYZ>::Ptr cloud)
  523. {
  524. // // 点云z转90度,调试用
  525. //Eigen::AngleAxisd rot_z = Eigen::AngleAxisd(M_PI_2, Eigen::Vector3d::UnitZ());
  526. //for (size_t i = 0; i < cloud->size(); i++)
  527. //{
  528. // Eigen::Vector3d t_point(cloud->points[i].x, cloud->points[i].y, cloud->points[i].z);
  529. // t_point = rot_z.toRotationMatrix() * t_point;
  530. // cloud->points[i].x = t_point.x();
  531. // cloud->points[i].y = t_point.y();
  532. // cloud->points[i].z = t_point.z();
  533. //}
  534. std::lock_guard<std::mutex> lck(m_cloud_collection_mutex);
  535. mp_cloud_collection = cloud;
  536. // LOG(WARNING) << "update region cloud size: " << mp_cloud_collection->size() << ",,, input size: " << cloud->size();
  537. m_cloud_collection_time = std::chrono::system_clock::now();
  538. m_measure_condition.notify_one(false, true);
  539. // std::chrono::steady_clock::time_point t1 = std::chrono::steady_clock::now();
  540. // std::chrono::duration<double> time_used_update = std::chrono::duration_cast<std::chrono::duration<double>>(t1 - t0);
  541. // std::cout << "update cloud time: " << time_used_update.count() << std::endl;
  542. return SUCCESS;
  543. }
  544. void Ground_region::thread_measure_func()
  545. {
  546. while (m_measure_condition.is_alive())
  547. {
  548. m_measure_condition.wait();
  549. if (m_measure_condition.is_alive())
  550. {
  551. m_region_status = E_BUSY;
  552. detect_wheel_ceres3d::Detect_result t_result;
  553. Error_manager ec = detect(mp_cloud_collection, t_result);
  554. m_detect_update_time = std::chrono::system_clock::now();
  555. m_car_wheel_information.center_x = t_result.cx;
  556. m_car_wheel_information.center_y = t_result.cy;
  557. m_car_wheel_information.car_angle = t_result.theta;
  558. m_car_wheel_information.wheel_base = t_result.wheel_base;
  559. m_car_wheel_information.wheel_width = t_result.width;
  560. m_car_wheel_information.front_theta = t_result.front_theta;
  561. if (ec == SUCCESS)
  562. {
  563. m_car_wheel_information.correctness = true;
  564. Common_data::Car_wheel_information_stamped t_wheel_info_stamped;
  565. t_wheel_info_stamped.wheel_data = m_car_wheel_information;
  566. t_wheel_info_stamped.measure_time = m_detect_update_time;
  567. Measure_filter::get_instance_references().update_data(m_region.region_id(), t_wheel_info_stamped);
  568. }
  569. else
  570. {
  571. m_car_wheel_information.correctness = false;
  572. // LOG(ERROR) << ec.to_string();
  573. }
  574. }
  575. m_region_status = E_READY;
  576. }
  577. }