Open ChrisR48 opened 8 years ago
Quickfix for missing moveit:
touch src/hector_tracker_planning/hector_tracker_robot_moveit_config/CATKIN_IGNORE touch src/hector_observation_planner/argo_move_group/CATKIN_IGNORE touch src/hector_observation_planner/argo_move_group_msgs/CATKIN_IGNORE touch src/hector_move_group_capabilities/CATKIN_IGNORE touch src/hector_trac_ik/trac_ik_kinematics_plugin/CATKIN_IGNORE touch src/vigir_manipulation_planning/vigir_move_group/CATKIN_IGNORE touch src/vigir_manipulation_planning/vigir_lidar_octomap_updater/CATKIN_IGNORE
Quickfix for missing kindr:
touch src/elevation_mapping/CATKIN_IGNORE
There is also an issue with opencv:
In member function ‘void hector_rails_detection::RailsDetection::detectBlobs(const cv::Mat&, std::vectorcv::KeyPoint&)’: /opt/hector/hector_tracker_install/src/hector_perception/hector_rails_detection/src/rails_detection.cpp:309:9: error: ‘cv::SimpleBlobDetector’ has not been declared cv::SimpleBlobDetector::Params params;
quickfix: touch src/hector_perception/hector_rails_detection/CATKIN_IGNORE
stair_detection has also an issue:
/opt/hector/hector_tracker_install/src/hector_vision/hector_stair_detection/src/hector_stair_detection.cpp: In function ‘bool hector_stair_detection::customRegionGrowing(const pcl::PointNormal&, const pcl::PointNormal&, float)’: /opt/hector/hector_tracker_install/src/hector_vision/hector_stair_detection/src/hector_stair_detection.cpp:456:64: error: conversion from ‘const float [3]’ to non-scalar type ‘Eigen::Map<const Eigen::Matrix<float, 3, 1> >’ requested Eigen::Map
point_b_normal = point_b.normal;
quickfix: touch src/hector_vision/hector_stair_detection/CATKIN_IGNORE
Opencv3 is used for kinetic but some packages need opencv2.4 like hector_tpo_finder.
touch src/hector_tpofinder/CATKIN_IGNORE
barrel_detection_nodelet is missing blob detection from opencv
quickfix: touch src/hector_vision/hector_barrel_detection_nodelet/CATKIN_IGNORE
hector_color_detection_nodelet:
hector_nav_msgs/GetDistanceToObstacle.h: Datei oder Verzeichnis nicht gefunden
Quickfix: touch src/hector_vision/hector_color_detection_nodelet/CATKIN_IGNORE
hector_five_pipes_detection:
fatal error: vigir_perception_msgs/PointCloudRegionRequest.h: Datei oder Verzeichnis nicht gefunden
touch src/hector_perception/hector_five_pipes_detection/CATKIN_IGNORE
hazmat_detection: tpofinder is missing
touch src/hector_hazmat_detection/CATKIN_IGNORE
hector_heat_detection
/opt/hector/hector_tracker_install/src/hector_vision/hector_heat_detection/src/heat_detection.h:4:21: fatal error: ros/ros.h: Datei oder Verzeichnis nicht gefunden
touch src/hector_vision/hector_heat_detection/CATKIN_IGNORE
same with motion_detection
touch src/hector_vision/hector_motion_detection/CATKIN_IGNORE
sbpl is not present in kinetic, so sbpl_lattice_planner cannot compile
touch src/sbpl_lattice_planner/CATKIN_IGNORE touch src/hector_move_base_navigation/hector_move_base/CATKIN_IGNORE
src/simox/VirtualRobot/Visualization/TriMeshModel.cpp:56:53: error: ‘isnan’ was not declared in this scope
touch src/simox/CATKIN_IGNORE touch src/hector_simox/hector_simox_ros/CATKIN_IGNORE touch src/hector_trac_ik/trac_ik/CATKIN_IGNORE touch src/hector_trac_ik/trac_ik_lib/CATKIN_IGNORE
This ticket is to track infos and problems regarding the usage together with ros-kinetic.
Currently these packages are missing: