[jsk_pcl_ros] use arguments in order to change a behavior
[jsk_pcl_ros] remove unused arguments
[jsk_pcl_ros] remove unused white spaces
Contributors: eisoku9618
0.3.1 (2015-09-04)
[jsk_pcl_ros, jsk_perception] Fix dependency of jsk_recognition_utils for child packages
like jsk_rviz_plugins
Contributors: Ryohei Ueda
0.3.0 (2015-09-04)
[jsk_recognition_utils] Introduce new package jsk_recognition_utils
in order to use utility libraries defined in jsk_pcl_ros in jsk_perception
Contributors: Ryohei Ueda
0.2.18 (2015-09-04)
[jsk_recognition_utils] Introduce new package jsk_recognition_utils
in order to use utility libraries defined in jsk_pcl_ros in jsk_perception
[jsk_pcl_ros/RegionGrowingMultplePlaneSegmentation] Publish raw result of
region growing segmentation
[jsk_pcl_ros] Use distance based on polygon in order to take
into account occlusion
[jsk_pcl_ros] Remove outlier from laser range sensor in range_sensor_error_visualization
[jsk_pcl_ros] Visualize errors using scatter in depth_camera_error_visualization
[jsk_pcl_ros] Add tool to visualize error of stereo-based depth sensor
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Add
~use_init_polygon_likelihood parameter to initialize particles according
to likelihood field of jsk_recognition_msgs/PolygonArray
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Add ~use_plane_likelihood
parameter to take into account likelihood field of jsk_recognition_msgs/PolygonArray
[jsk_pcl_ros] Separate definition of ParticleCuboid into another header
[jsk_pcl_ros] Publish standard deviation error of range sensor in range_sensor_error_visualization
[jsk_pcl_ros] Add nodelet to compte polygon likelihood based on area difference
[jsk_pcl_ros] Add nodelet to compte polygon likelihood based on angular
difference
[jsk_pcl_ros/PolygonArrayDistanceLikelihood] Compute polygon's likelihood
according to distance from specified frame_id.
[jsk_pcl_ros] Move EarClippingPatched to pcl/ directory
[jsk_pcl_ros] Add tool to visualize variance of raser scan
[jsk_pcl_ros] Rename ros_collaborative_particle_filter.h to pcl/simple_particle_filter.h
[jsk_pcl_ros] Add sensor model to compute expected number of points with
specific distance and area.
[jsk_pcl_ros/TiltLaserListener] Publish velocity of rotating laser
[jsk_pcl_ros] Fix small bugs about nearest distance computation and add sample
[jsk_pcl_ros/geo_util] Compute nearest point to a cube
[jsk_pcl_ros/geo_util] Compute nearest point to a polygon
[jsk_pcl_ros/ExtractCuboidParticlesTopN] Publish point indices instead
of particle pointcloud.
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Use world z coordinates to reject
unexpected initial particles
[jsk_pcl_ros/ICPRegistration] Support NDT based transformation estimation
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Use kdtree to search candidate
points roughly and close prism input hull to extract candidate points correctly
[jsk_pcl_ros] Add sample to collaborate particle filter based estimator
and occlusion free goal sampler
[jsk_pcl_ros/OcclusionBoundingBoxRejector] Do not synchronize input topics
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Use area instead of volume
to evaluate size of cuboid
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Use minimum covariance value
0.
It's mathematically no means but we can implement it by handling zero
as special case.
[jsk_pcl_ros] Fix computation of coordinates of polygon
[jsk_pcl_ros] Fix computation of coordinates of polygon
[jsk_pcl_ros/RegionGrowingMultiplePlaneSegmentation] Check direction of polygons
to direct to origin of pointcloud.
use resizer
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Add
inverse_volume_likelihood function
[jsk_pcl_ros/EuclideanClusterExtraction] Do not have using namespace
std, pcl in header file, it may effect other codes globally.
[jsk_pcl_ros] Sort headers of build_check.cpp order in alphabetical order
[jsk_pcl_ros/ColorizeSegmentedRF] Fix include guard not to collide with colorize_random_points_rf.h
[jsk_pcl_ros/MaskImageToDepthConsideredMaskImage] Fix include guard
[jsk_pcl_ros] Fix ExtractCuboidParticlesTopN by removing template super
class, which is too difficult to handle shared_ptr owenership.
And update build_check.cpp.in to instantiate all the nodelet classes
to check implementation of prototype definitions.
[jsk_pcl_ros/ExtractCuboidParticlesTopN] Publish particles as BoundingBoxArray
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Fix particle initialization
if plane coordinates is not equal to itentity and compute distance of
occluded points based on sphere approximation
[jsk_pcl_ros] Fix Polygon::decomposeToTriangles. EarClip of pcl
1.7.2 (hydro) has a fatal bug and copied the latest implementation from
current master and rename it as EarClipPatched.
We cam remove the codes after we deprecate hydro.
[jsk_pcl_ros] Update sample to use tf_transform_bounding_box_array
[jsk_pcl_ros] Add TfTransformBoundingBoxArray
multi_resolution_organized_pointcloud.launch
[jsk_pcl_ros] Add ExtractCuboidParticlesTopN to extract top-N particles
[jsk_pcl_ros] Add TfTransformBoundingBox like TfTransformPointCloud
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Register particle point in
order to convert to PCLPointCloud2 and it enables to publish all the
fields of ParticleCuboid as fields of sensor_msgs::PointCloud2
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Update relationship between
particles and polygons as polygon sensor measurement is updated
[jsk_pcl_ros] Run rviz in sample_boundingbox_occlusion_rejector.launch
[jsk_pcl_ros] Allow variance=0.0 in computing gaussian
[jsk_pcl_ros] Link libjsk_pcl_ros_util with libjsk_pcl_ros_base
[jsk_pcl_ros] Check all the methods and functions are implemented by
compiling build_check.cpp with all the headeres except for kinfu and
point_types.h.
build_check.cpp is automatically generated with all the header neames
and build_check.cpp.in.
[jsk_pcl_ros/BoundingBoxOcclusionRejector] Nodelet to reject bounding
box which occludes target objects.
This nodelet is good for occlusion-free goal planning
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Compute likelihood based on plane-detection-sensor
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Remove unused parameters from class member
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] More correct border condition about occlusion
Remove files which added by mistake
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Support sensor_frame via ~sensor_frame parameter
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Separate likelihood computation parameters from particlefilter parameter to cleanup dynamic_reconfigure parameters
[jsk_pcl_ros] Add InteractiveCuboidLikelihood to confirm behavior of likelihood function of PlaneSupportedCuboidEstimator by interactive server
Contributors: Ryohei Ueda
0.2.15 (2015-08-18)
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Add ~min_inliers and
~outlier_distance parameter
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Take occlusion into account
[jsk_pcl_ros/PlaneSupportedCuboidEstimator] Add ~use_range_likelihood to
toggle use likelihood based on geometric constraint
Merge pull request #1054 from garaemon/plane-supported-cuboid-estimator
[jsk_pcl_ros/PlaneSupportedCuboidestimator] Add new nodelet to estimate cuboid on plane based on bayesian recursive estimation
[jsk_pcl_ros/PlaneSupportedCuboidestimator] Add new nodelet to estimate
cuboid on plane based on bayesian recursive estimation, especially
particle filter is used.
[jsk_pcl_ros] Add simple code and script to bench RANSAC based plane estimation
[jsk_pcl_ros/AttentionClipper] Fix compilation warning:
1. fixing name confliction of iteration index
2. Use std::runtime_error to catch exception
[jsk_pcl_ros] Super simple script to plot gaussian. It is useful to
determin several parameters based on normal distribution
[jsk_pcl_ros] fix flip option
Contributors: Ryohei Ueda, Hitoshi Kamada
0.2.14 (2015-08-13)
[jsk_pcl_ros/PoseWithCovarianceStampedtoGussianPointCloud] Add new
normalize method: normalize_area and normalize_height
[jsk_pcl_ros/PoseWithCovarianceStampedtoGussianPointCloud] Fix to apply sqrt
[jsk_pcl_ros/PoseWithCovarianceStampedtoGussianPointCloud] Add offset to z-height
[jsk_pcl_ros] Update image on readme about PoseWithCovarianceStampedToGaussianCloud
machine tag should defined in somewhere else, not here
[jsk_pcl_ros] Add new nodelet to convert geometry_msgs/PoseWithCovarianceStamped to PointCloud with
gaussian distribution
[jsk_pcl_ros] fix typo in multi_resolution_organized_pointcloud.launch
[jsk_pcl_ros] add OrganizedNeighbor search method in ParticleFilterTracking
[jsk_pcl_ros/TfTransformCloud] Use tf::MessageFilter
[jsk_pcl_ros/stereo_reconstruction.launch] Fix several remappings
[jsk_pcl_ros] Update stereo_reconstruction.launch for the latest jsk_topic_tools
move model with pose and take color in condition
[jsk_pcl_ros] set tracking model with marker in particle_filter_tracker
[jsk_pcl_ros/TiltLaserListener] Add ~clear_assembled_scans parameter not to
publish same scans twice
[jsk_pcl_ros/ICPRegistration] Add parameters for RANSAC
[jsk_pcl_ros/TiltLaserListener] Do not publish empty pointcloud if buffer is empty
[jsk_pcl_ros] add pointcloud_to_stl nodelet
[jsk_pcl_ros] Fix optimization flag
[jsk_pcl_ros/EnvironmentPlaneModeling] Fix to make it sure to close the
loop of convex hull
[jsk_pcl_ros/EnvironmentPlaneModeling] Fix polygon orientation when
magnify it
[jsk_pcl_ros] Add diagnostics information to NormalDirectionFilter,
NormalEstimationOMP and RegionGrowingMultiplePlaneSegmentation
[jsk_pcl_ros/TfTransformCloud] Add diagnostic information
[jsk_pcl_ros/NormalFlip] Fix direction of normal flip
[jsk_pcl_ros/TiltLaserListener] Add diagnostic information
change default value of max_distance
fix particle filter tracker
edit to only remove -std option
fix c++ version mismatch problem with boost
[jsk_pcl_ros/handle_estimator.l] change jsk_pcl_ros msgs to jsk_recognition_msgs
[jsk_pcl_ros] Downsample registered pointcloud for visualization in pointcloud_localizaiton.launch
[jsk_pcl_ros/PointCloudLocalization] poke vital_checker for diagnostics
[jsk_pcl_ros] Add launch file to run pointcloud_localization
[jsk_pcl_ros] Remove model_file argument
[jsk_pcl_ros] Fix missing display_machine arg
[jsk_pcl_ros] Do not link gpu libraries if cmake fails to detect PCL_GPU modules
[jsk_pcl_ros/Kinfu] Publish transformation from map to odom
[jsk_pcl_ros] Add Kinfu nodelet
[jsk_pcl_ros/TiltLaserListener] Add ~not_use_laser_assembler_service
parameter not to use laser_assembler service API but assemble scan
pointcloud locally
[jsk_pcl_ros/SnapIt] Reset cached polygons when unsubscribe() is called
[jsk_pcl_ros] Do not die even if failed to call laser assemble in TiltLaserListener
[jsk_pcl_ros] Do not close convex polygon when building grid plane
[jsk_pcl_ros] Add debug message about grid plane construction in EnvironmentPlaneModeling
[jsk_pcl_ros] Do not publish projected polygon if it failed to estimate 3d point in ScreenPoint
[jsk_pcl_ros] Support ~always_subscribe in mask_image_filter
[jsk_pcl_ros] Add ~sensor_frame to MultiPlaneExtraction
[jsk_pcl_ros] Add waitForTransform to snapit tf resolvance
[jsk_pcl_ros/RegionGrowingMultiplePlaneSegmentation] Fix computation of
normal to decide order of vertices by comparing normals from vertices and coefficients
[jsk_pcl_ros] Untabify attention clipper
[jsk_pcl_ros/MultiPlaneExtraction] Support negative value for
magnification of plane
[jsk_pcl_ros/octree_change_detector] add MACHINE tag to octree_change_detector.launch
[jsk_pcl_ros] Add ~strict_tf parameter to NormalFlipToFrame to ignore
timestamp correctness
add topics for other recognition nodes
[jsk_pcl_ros] Add NormalEstimationOMP like pcl_ros but it can handle
timestamp correctly
[jsk_pcl_ros/EnvironemntPlaneModeling] Add normal direction threshold
[jsk_pcl_ros/TfTransformPointCloud] Ignore all error in tf conversion
[jsk_pcl_ros/HintedPlaneDetector] Supress warning messages about pointcloud fields
[jsk_pcl_ros]add exceptions around tf
[jsk_pcl_ros] Check if hint convex is valid in HintedPlaneDetector
[jsk_pcl_ros] Do not publish results if it failes to compute PCA in
ClusterPointIndicesDecomposer
[jsk_pcl_ros] Longer TF cache time for TreansformListener which created
via TFListenerSingleton
[jsk_pcl_ros/TiltLaserListener] Do not unsubscribe input topics if no
needed, change it to always subscribe input joint states
[jsk_pcl_ros] Add new nodelet: NormalFlipToFrame to align direction of
normal to specified frame_id
[jsk_pcl_ros] Use jsk_topic_tools/log_utils.h
[jsk_pcl_ros] Add ~queue_size parameter to NormalDirectionFilter
[jsk_pcl_ros] Add class and method name to tf error
[jsk_pcl_ros] Cache result of triangle decomposition
Contributors: Ryohei Ueda, Yu Ohara, Yuki Furuta
0.2.12 (2015-05-04)
[jsk_pcl_ros] fix attention clipper non nan part
[jsk_pcl_ros] Add getRadius method to Cylinder
[jsk_pcl_ros] Remove nan indices from AttentionClipper
[jsk_pcl_ros] add prefixes params to publish each indices in AttentionClipper
[jsk_pcl_ros] Set pcl verbosity level to ERROR in multi_plane_extraction
[jsk_pcl_ros] Relay organized point cloud to "points" topic in stereo_reconstruction.launch
[jsk_pcl_ros] Ignore tf timestamp in TfTransformPointCloud if ~use_latest_tf is set
[jsk_pcl_ros] Add stereo_reconstruction.launch to reconstruct stereo
pointcloud from color images and depth image
[jsk_pcl_ros] Relay compressed images too in multi_resolution_organized_pointcloud.launch
[jsk_pcl_ros] Add FeatureRegistration to register pointclouds using 3D feature
[jsk_pcl_ros] Add PlanarPointCloudSimulator
[jsk_pcl_ros] Do not apply PCA for small pointclouds
Merge pull request #737 from garaemon/spherical-cloud-simulator
[jsk_pcl_ros] Add SphericalPointCloudSimulator nodelet to simulate spindle laser scanner
[jsk_pcl_ros] Add SphericalPointCloudSimulator nodelet to simulate
pindle laser scanner
[jsk_pcl_ros] Add ~use_async parameter to NormalConcatenater
[jsk_pcl_ros] Fix direction of y-axis of bounding box to direct toward z-axis of pointcloud
[jsk_pcl_ros] Support normal in ICPRegistration nodelet
add simple_edge_detector_and_tracker.launch
[jsk_pcl_ros] add PCL_INCLUDE_DIRS to suppress error of compiling organized_edge_detector
[jsk_pcl_ros] repair include filed of organized_edge_detector
[jsk_pcl_ros] Use Eigen::Quaternionf::setFromTwoVectors to align box on plane
change reversed imu plane direction
Merge pull request #728 from YuOhara/add_hinted_handle_estimator
Add hinted handle estimator
add comments
add_debug_visualizer
add hinted_handle_estimator
fix missing include def
[jsk_pcl_ros] Optimized HintedStickFinder
1. Use input pointcloud with normal not to run normal estimation in
HintedStickFinder
2. Add ~not_synchronize parameter to keep processing without more hint
[jsk_pcl_ros] Move documentation about
pointcloud_screenpoint_sample.launch from index.rst to README.md.
And deprecate sphinx documentation.
[jsk_pcl_ros] Wait for next new image in shutter callback in IntermittentImageAnnotator
[jsk_pcl_ros] Deprecate several nodelets
Merge pull request #717 from YuOhara/remove_bags_in_libname
remove bag in libname
Merge pull request #711 from YuOhara/add_mask_image_indices_concatator
Add mask image indices concatator
reversed plane direction
[jsk_pcl_ros] Return true in clear callback of IntermittentImageAnnotator
add imu_orientated_plane_rejector
remove bag in libname
renamed file name
rename mask_image_cluster_indices_concatenator to mask_image_cluster_filter
Merge remote-tracking branch 'origin/master' into add_mask_image_indices_concatator
[jsk_pcl_ros] Compile without optimization on travis
[jsk_pcl_ros] Add launch file for torus finder
[jsk_pcl_ros] Separate moveit filter into libjsk_pcl_ros_moveit
add topic to sync timestamp
changed sample_launch for concat indices
add indices concatenator_node with mask
renamed node
add imu_orientated plane detector and launch for icp-use
[jsk_pcl_ros] changed miss params and comment in data_names out of git
[jsk_pcl_ros] Add debug printing for tiem stamp confusing problem of resize_point_cloud
[jsk_pcl_ros] Fix advertise type for template pointcloud:
geometry_msgs/PoseStamped -> sensor_msgs/PointCloud2
[jsk_pcl_ros] Fix torus direciton to orient to sensor origin
[jsk_pcl_ros] Fix detected stick direction always directs to -y upper
[jsk_pcl_ros] Use triangle decomposition to check a point is inside
or not of polygon
[jsk_pcl_ros] Add picture of LINEMODDetector
[jsk_pcl_ros] SupervoxelSegmentation: new nodelet to wrap
pcl::SupervoxelClustering
[jsk_pcl_ros] Refine Model by ICP in IncrementalModelRegistration
[jsk_pcl_ros] Add simple icp service to ICPRegistration
[jsk_pcl_ros] add utility launch file to capture training data from multisense
[jsk_pcl_ros] Publish the number of samples from CaptureStereoSynchronizer
[jsk_pcl_ros] Fix when ROI is outside of the image in AttentionClipper
[jsk_pcl_ros] Fix when ROI is outside of the image in AttentionClipper
Merge pull request #532 from garaemon/add-mask-image-to-point-indices
[jsk_pcl_ros] Add MaskImageToPointIndices
Merge pull request #531 from garaemon/add-incremental-pointcloud-registration
[jsk_pcl_ros] IncrementalModelRegistration Add new nodelet to build full 3d model from sequentially captured pointcloud
fix to compile on indigo #529
[jsk_pcl_ros] MaskImageToPointIndices: add nodelet to convert mask image to point indices
[jsk_pcl_ros] Add new nodelet to build full 3d model from
sequentially captured pointcloud: IncrementalModelRegistration
Merge remote-tracking branch 'origin/master' into add-more-parameter-for-calibration
Conflicts:
jsk_pcl_ros/launch/openni2_remote.launch
Add uv_scale parameter to depth_calibration.cpp and update openni2_remote.launch
to specify more parameter.
0.1.24 (2014-11-15)
Add default calibration file for openni2_remote.launch
remove unneeded nodelet part
change param
added launch that calc plane with pr2_laser
Fix polygon projection and confirm that snapit works
Fix MultiPlaneExtraction initialization
Update SnapIt to use topic interface and reimplement it only for snap on polygon
Fix segv in collision checking
Fix OrganizedMultiPlaneSegmentation indexing
Update diagnostics aggregator settings for footstep_recognition
Fix diagnostic information when there is no subscriber
Suppress message from EnvironmentPlaneModeling
Add document about MultiPlaneExtraction
Check the pointer is correctly set to avoid SEGV
Add normal direction filter based on Imu direction
Update OrganizedMultiPlaneDetection documentation
Add new nodelet: region growing based multiple plane detection
use this->erase
Add imu hint when running MultiPlaneSACSegmentation
Add short documentation about OrganizedMultiPlaneSegmentation
Update document about CentroidPublisher
Add documentation about jsk_pcl/ClusterPointIndicesDecomposerZAxis
Add moveit plugin to just filter pointcloud which belongs to robot
Add nodelet to handle time range of rotating laser
removed passthrough filter
rename file name from error_visualize to pr2_pointcloud_error_visualizatoin
Support cluster information in MultiplePlaneSACSegmentation and remove
plane estimation from LineSegmentCollector
restored codes slightly
added icp_result_msgs and srvs
change launch file path
add launch files for visualizing calibration error
Add nodelet to handle time range of rotating laser
Fix Polygon::decomposeToTriangles if the original polygon is already a triangle
Remove single_nodelet_exec.cpp.in
Add documentation about ClusterPointIndicesDecomposer
Add image to documentation of EuclideanClustering
Add documentation about EuclideanSegmentation
Add documentation about DepthImageCreator
Add documentation about PointcloudScreenpoint
Support specifying yaml file to calibrate depth image on openni2_remote.launch
Format calibration model on DepthCalibration
For precision requirement, use repr function when generating yaml file
for depth image calibration
Support quadratic model for u and v to calibrate depth image:
1. Support quadratic-uv-quadratic and quadratic-uv-quadratic-abs model
2. use SetDepthCalibrationParameter.srv to specify depth calibration parameter
Downsize frequency map resolution and add --width and --height option to
depth_error_calibration.py
Update depth calibration program.
1. Fix checkerboard_detector to publish correct corner point
2. Calibrate depth_image rather than PointCloud
3. Use matplotlib animation to visualize graph in depth_error_calibration.py
support new model to calibrate kinect like sensor, which use absolute
value respected to center coordinate of projectoin matrix
Support quadratic-uv-abs model
Add service file: DepthCalibrationParameter
Add nodelet to apply calibration parameter to pointcloud. and add
new model to calibrate: quadratic-uv
Support quadratic function fitting in depth_error_calibration.py
Add python script to calibrate depth error of depth sensors
Merge remote-tracking branch 'refs/remotes/origin/master' into add-document-about-resize-points
Conflicts:
jsk_pcl_ros/README.md
Add script to run logistic regression for depth error
Add documentation about ResizePointCloud
Merge remote-tracking branch 'refs/remotes/origin/master' into remove-color-category20-from-jsk-pcl-ros
Conflicts:
jsk_pcl_ros/include/jsk_pcl_ros/pcl_util.h
Remove colorCategory20 from jsk_pcl_ros and use jsk_topic_tools' colorCategory20
Fix syntax of README.md of jsk_pcl_ros
Add documentation about ResizePointCloud
Add documentation about typical messages defined in jsk_pcl_ros
Extract multi planes out of collected segmented lines from laserrange finder
add new nodelet: LienSegmentCollector
Add LineSegmentDetector for LRF pointcloud
Use dynamic reconfigure to specify several parameters for ParticleFilterTracking
Support contiuous model building on EnvironmentPlaneModeling and add
a launch file for footstep planning recogniton
Add utitlity service interface to register completed maps
Use pcl::EarClip to decompose polygon into triangles
Complete gridmap with statically defined polygon
Install nodelet executables
Use jsk_topic_tools::readVectorParameter in ParticleFilterTracking
Add BilateralFilter
Decrease size of grid map to add 'padding'
Add service to clear grid maps
Add min-max threshold to filter polygons based on area on OrganizedMultiPlaneSegmentation
EnvironmentPlaneModeling support building grid map without static
polygon information
delete models
Fix env_server's mis posing of origin
Force for planes to direct sensor origin in organized multi segmentation
Support PointcloudDatabaseServer when running ICPRegistration
Add PointCloudDatabaseServer
Fix keypoints publisher compilation
Subscribe topics as needed for almost all the nodelets
Use ConnectionBasedNodelet for DelayPointCloud not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for ColorizeDistanceFromPlane not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for DelayPointcloud not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for ColorizeDistanceFromPlane not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for ColorHistogramMatcher not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for BoundingBoxFilter not to subscribe topics if the nodelet's publishers are not subscribed
Use ConnectionBasedNodelet for ResizePointsPublisher not to subscribe
topics if the nodelet's publishers are not subscribed
Do not subscribe until any publish is subscribed on ColorFIlter and
BorderEstimator
Do not subscribe until any publisher is subscribed on
ClusterPointIndicesDecomposer and add utlity class to handle connection
Fix JointStateStaticFilter to use absolute diff when calculating
time difference and add JointStateStaticFilter to organized_multi_plane_segmentation.launch
if JOINT_STATIC_FILTER:=true
Use refined plane information in recognition pipeline
Add pr2_navigation_self_filter to organized_multi_plane_segmentation.launch
Publish result of ICP as geometry_msgs::PoseStamped
Add pcd model files for registration sample
Use PLUGIN_EXPORT_CLASS instead of PLUGIN_DECLARE_CLASS
Considering flipped initial pose on ICP registration
Merge remote-tracking branch 'refs/remotes/origin/master' into use-boundingbox-information-to-compute-origin-of-icp-pointcloud
Conflicts:
jsk_pcl_ros/jsk_pcl_nodelets.xml
Add new nodelet to transform pointcloud to make its origin equal to the
pose of boundingbox and use bounding box information when running ICP
Merge pull request #307 from garaemon/joint-state-static-pointcloud-filter
JointStateStaticFilter
Add Generalized ICP algorithm
read voxel grid donwsample manager parameter
Merge remote-tracking branch 'refs/remotes/origin/master' into garaemon-joint-state-static-pointcloud-filter
Conflicts:
jsk_pcl_ros/CMakeLists.txt
jsk_pcl_ros/catkin.cmake
jsk_pcl_ros/jsk_pcl_nodelets.xml
Add new nodelet to pass pointcloud only if joint states is stable
Support dynamic_reconfigure of ICPRegistration
add new nodelet to align two pointcloud based on ICP algorithm
Fix for plane segmentation results into only one plane
Add new nodelet 'PlaneReasoner' to segment wall/ground
Resize pointcloud and images in openni_remote.launch
Fix topic relaying of openni_remote for openni_launch on hydro
Add new nodelet to filter organized pointcloud based on x-y index rather
than 3-D position value.
Check align axis before aligning boundingbox in ClusterPointIndicesDecomposer
Add diagnostic information to EuclideanClusteringExtraction
Add diagnostic information to MultiPlaneExtraction
Add processing frame id information to PlaneRejector's diagnostic
Add diagnostic information to ClusterPointIndicesDecomposer
Add diagnostics to PlaneRejector
Add more diagnostics to OrganizedMultiPlaneSegmentation and fix global
hook for ConvexHull
Contributors: Ryohei Ueda
0.1.20 (2014-09-17)
Not use inliers to colorize pointcloud based on distance from planes
Add check to be able to make convex or not on ColorizeDistanceFromPlane
and OrganizedMultiPlaneSegmentation
add ~use_normal to use noraml to segment multi planes
add new nodelet to segment multiple planese by applying RANSAC recursively
Contributors: Ryohei Ueda
0.1.19 (2014-09-15)
0.1.18 (2014-09-13)
Subscribe PolygonArray message to build ConvexPolygon in ColorizeDistanceFromPlane
Introduce global mutex for quick hull
Fix coloring bug and add ~only_projectable parameter to visualize the
points only if they can be projected on the convex region
Add use_laser_pipeline argument to laserscan_registration.launch to
toggle include laser_pileline.launch of jsk_tilt_laser or not
Add new utility for diagnostics: addDiagnosticInformation
Supress output from resize_points_publisher
ROS_INFO -> NODELET_DEBUG in VoxelGridDownsampleManager
New utilify functoin for diagnostic: addDiagnosticInformation.
It's a simple function to add jsk_topic_tools::TimeAccumulator to
diagnostic_updater::DiagnosticStatusWrapper.
Colorize pointcloud according to the distance from nearest plane
Use template functions to convert tiny type conversions
Refine the result of connecting small multi planes in OrganizedMultiplaneSegmentation
add hsv coherence to particle_fitler_tracker
change color_histogram showing methods with reconfigure
visualize color_histogram coefficience
add new nodelet: EdgebasedCubeFinder
use colorCategory20 function to colorize pointcloud in ClusterPointIndicesDecomposer
visualizing connection of planes with lines in OrganizedMultiPlaneSegmentation
use rosparam_utils of jsk_topic_tools in StaticPolygonArrayPublisher
Contributors: Ryohei Ueda, Wesley Chan, Yu Ohara
0.1.17 (2014-09-07)
add laser_registration.launch
Contributors: Yuki Furuta
0.1.16 (2014-09-04)
bugfix: add depth_image_creator to jsk_pcl_nodelet on catkin.cmake
a launch file for stereo camera using pointgrey
Publish ModelCoefficients from EdgeDepthRefinement
Add new nodelet to detect parallel edge
Remove duplicated edges according to the line coefficients in
EdgeDepthRefinement
do not use EIGEN_ALIGNED_NEW_OPERATOR and use onInit super method on
PointcloudScreenpoint
Remove several unused headers from ParticleFilterTracking
not compile OrganizedEdgeDetector on groovy
add a new nodelet to refine edges based on depth connectivity
Detect straight edges from organized pointcloud
toggle edge feature by rqt_reqoncifugre in OrganizedEdgeDetector
add new nodelet: OrganizedEdgeDetector, which is only available with
latest PCL
Do not include header of cloud viewer in region_growing_segmentation.h
Add more diagnostic information to OrganizedMultiPlaneSegmentation
downsample rgb as well as pointcloud in openni2_remote.launch
add new nodelet: BorderEstimator
Contributors: Ryohei Ueda, Yuki Furuta
0.1.14 (2014-08-01)
add bounging box movement msg
Contributors: Yusuke Furuta
0.1.13 (2014-07-29)
add include of pcl_util.h to OrganizedMultiPlaneSegmentation
use jsk_topic_tools::TimeAccumulator instead of
jsk_pcl_ros::TimeAccumulator in jsk_pcl_ros
new class to check connectivity; VitalChecker
fixing the usage of boost::mutex::scoped_lock
use Eigen::Vector3f as a default type in geo_util classes
Contributors: Ryohei Ueda
0.1.12 (2014-07-24)
Merge pull request #210 from aginika/add-remove-nan-funtion-line
Add remove nan funtion line
prevent nan pointcloud error with inserting removeNan function in ParticleFilterTracking
fix environment modeling and changed api to lock/unlock environment
remove border region from environment model
publish diagnostic information from OrganizedMultiPlaneSementation
take the average of plane coefficients to be combined in EnvironmentPlaneModeling
wait transform before transforming in PolygonArrayTransformer
convert convex line information into grid cell before computing grid cell
fix normalization of the normal when creating Polygon object
catch more exceptions in TfTransformPointCloud nodelet
Supress debug message from ColorHistogramMatcher
fill x-y-z field to publish correct pose of the pointcloud from ColorHistogramMatcher
publish the pose of the best matched candidate in ColorHistogramMatcher
publish selected handle pose
publish u, v, true_depth and observed_depth
fix the order of Mat::at
add two nodelets (DelayPointCloud and DepthImageError) to jsk_pcl_ros
and publish u/v coordinates of the checkerboard from checkerboard_detector.
* DepthImageError is just a skelton yet.
* DelayPointCloud re-publishes pointcloud with specified delay time.
* publish u/v coordinates from checkerboard_detector.
* frame_id broadcasted from objectdetection_tf_publisher.py is configurable
copy the header of the input cloud to the output cloud in SelectedClusterPublisher
new nodelet to reject the plane which does not satisfy the threshold
about normal direction
simplyfy tracking and add update with msg function
0.1.6 (2014-05-30)
0.1.5 (2014-05-29)
add new nodelet to publish the points of the cluster selected by
jsk_pcl_ros/Int32Stamped.
this nodelet is supposed to be used with jsk_interactive_marker/bounding_box_marker
align the boxes to the nearest plane
add new parameter publish_clouds to ClusterPointIndicesDecomposer
to disable publishing decomposed pointclouds
add new message: BoundingBox and BoundingBoxArray and publish
BoundingBoxArray from ClusterPointIndicesDecomposer
use enum to select estimation method of NormalEstimationIntegralImage
add launch and rviz file for subway bagfiles
remove IndiceArray.msg, which are not used any more
publish empty result if segmentation failed
update the default parameters
use PointXYZRGBNormal rather than PointXYZ nor Normal to speed up
pointcloud conversion between ROS <-> PCL
for realtime organized multi plane segmentation, add optimization flag
add curvature veature
comment in again and remove centroid publisher
fix conflicts
fix the size of the AABB published from ClusterPointIndicesDecomposer
update launch file for OrganizedMultiPlaneSegmentatoin.
introduce several arguments.
add several HzMeasure to measure the speed of the processing
add new nodelet: NormalEstimationIntegralImage
add new nodelet: NormalEstimationIntegralImage
add dynamic reconfigure to MultiPlaneExtraction
commnet out hsv-limit and remove centroid publisher
use ExtractPolygonalPrismData class to extract the pointcloud ON the planes
add new class: MultiPlaneExtraction to extract the points which does not
belong to the planes. However it's not so stable and efficient now
publish the result of the clustring as polygon with convex hull
reconstruction. and publish the result of the plane estimation as ModelCoefficientsArray.
implement connectiong of the planes segmented by organized multi planse segmentation
output the segmentation as PolygonArray as the result of
OrganizedMultiPlaneSegmentation
delete unneeded files
rearrange many launch files , rviz files and add sample for rosbags
add argument for camera_info url
fix for groovy
does not compile region growing segmentation on groovy
publish colorized points from cluster point indices decomposer
does not compile on groovy
does not compile region growing segmentation on groovy
implement OrganizedMultiPlaneSegmentation
add new nodelet: RegionGrowingSegmentation based
on pcl::RegionGrowingSegmentation class
add pcl_ros/NormalConcatenater nodelet.
it retrieves PointXYZRGB from ~input and Normal from ~normal and
concatenate them into ~output as PointXYZRGBNormal
update index.rst
delete wrong commited files
update README and arrage some launch files directory
fix for groovy
use pclpointcloud2
add sample_610_clothes.launch
remove the sample launch files for non-used color converter and color filter
rename rgb_color_filter.cpp and rgb_color_filter.h
to rgb color_filter.cpp and color_filter.h.
use the lines rather than cube to visualize bounding box
add hsi_color_filter executable
implement resize_points_publisher w/o filter class.
remove nonused files such as color_filter, color_converter and so on.
add marker to display the result of the clustering as bounding boxes
publishes tf frames to the center of the clusters
add euclidean clustering, decomposer and zfilter
add filter.cpp to jsk_pcl_ros on rosbuild. because resize points publisher requires it.
this is a hotfix, so I will re-implement that nodelet w/o filter.cpp
support groovy and pcl 1.6
compile cluster_point_indices_decomposer and cluster_point_indices_decomposer_z_axis on catkin
compile euclidean_cluster_extraction_nodelet.cpp on catkin
add add HSI Color filter
rgb_color_filter.launch: add comment and launch centroid_publisher as default
catch tf exception
remove redundant declaration of TransformBroadcaster
remove redundant declaration of TransformBroadcaster
update README and add centroid related files
do not run dynamic reconfigure callback and topic callback symultenously
support ~indices topic to specify indices vector of the points and refactor codes
re-implement RGBColorFilter as simpler class
add centroid_publisher to catkin
add tracking rviz config
delete unneeded line in tf_transfomr_cloud.launch
add tf transform cloud launch and rviz
add octree_change_detector.launch
add group tag to create local scope to remap several topics in openni2.launch
To update README, add explanation to tracking , octree and tf cloud
relaying camera_info under camera_remote namespace
add tf transform nodelet
make paritcal_filter_tracking_nodelet publish tracked object tf trasnformation
add two launch files to run openni on remote machine