diff --git a/misc/ompl/Makefile b/misc/ompl/Makefile index 16e7b9570cb5..40895118656e 100644 --- a/misc/ompl/Makefile +++ b/misc/ompl/Makefile @@ -1,57 +1,57 @@ PORTNAME= ompl -DISTVERSION= 1.5.2 -PORTREVISION= 3 +DISTVERSION= 1.6.0 CATEGORIES= misc comms MAINTAINER= yuri@FreeBSD.org COMMENT= Open Motion Planning Library WWW= https://ompl.kavrakilab.org/ LICENSE= BSD3CLAUSE LICENSE_FILE= ${WRKSRC}/LICENSE LIB_DEPENDS= libboost_system.so:devel/boost-libs -USES= cmake compiler:c++11-lang eigen:3 pkgconfig +USES= cmake:testing compiler:c++11-lang eigen:3 pkgconfig USE_GITHUB= yes USE_LDCONFIG= yes CMAKE_OFF= OMPL_REGISTRATION OMPL_BUILD_TESTS OMPL_BUILD_DEMOS OMPL_VERSIONED_INSTALL +CMAKE_TESTING_ON= OMPL_BUILD_TESTS OPTIONS_DEFINE= FLANN MORSE OPENDE SPOT TRIANGLE PLANNERARENA OPTIONS_DEFAULT= FLANN MORSE OPENDE TRIANGLE OPTIONS_SUB= yes FLANN_DESC= Use FLANN for nearest neighbor queries FLANN_LIB_DEPENDS= libflann.so:math/flann MORSE_DESC= Include a plugin for the MORSE Robot Simulation engine MORSE_BUILD_DEPENDS= morse-robotics>0:misc/morse MORSE_RUN_DEPENDS= morse-robotics>0:misc/morse OPENDE_DESC= Use Open Dynamics Engine for kinodynamic planning OPENDE_LIB_DEPENDS= libode.so:devel/ode SPOT_DESC= Use 'Spot' for creating finite automata from LTL formulae SPOT_USES= compiler:c++14-lang SPOT_LIB_DEPENDS= libspot.so:math/spot TRIANGLE_DESC= Create triangular decompositions of 2D polygons TRIANGLE_LIB_DEPENDS= libtriangle.so:math/triangle PLANNERARENA_DESC= Install plannerarena (depends on R) PLANNERARENA_BUILD_DEPENDS= Rscript:math/R PLANNERARENA_RUN_DEPENDS= Rscript:math/R .for o in ${OPTIONS_DEFINE:NPLANNERARENA} post-patch-${o}-off: @${REINPLACE_CMD} 's|find_package(${o}|#&|i' ${WRKSRC}/CMakeLists.txt .endfor post-patch-PLANNERARENA-off: @${REINPLACE_CMD} 's|find_program(R_EXEC|#&|' ${WRKSRC}/CMakeLists.txt post-configure: @${REINPLACE_CMD} 's|/usr/bin/morse|${LOCALBASE}/bin/morse|' ${BUILD_WRKSRC}/CMakeCache.txt .include diff --git a/misc/ompl/distinfo b/misc/ompl/distinfo index 126ebe357190..a0bff8100e5e 100644 --- a/misc/ompl/distinfo +++ b/misc/ompl/distinfo @@ -1,3 +1,3 @@ -TIMESTAMP = 1614987585 -SHA256 (ompl-ompl-1.5.2_GH0.tar.gz) = db1665dd2163697437ef155668fdde6101109e064a2d1a04148e45b3747d5f98 -SIZE (ompl-ompl-1.5.2_GH0.tar.gz) = 23082698 +TIMESTAMP = 1673205806 +SHA256 (ompl-ompl-1.6.0_GH0.tar.gz) = f03daa95d2bbf1c21e91a38786242c245f4740f16aa9e9adbf7c7e0236e3c625 +SIZE (ompl-ompl-1.6.0_GH0.tar.gz) = 23395043 diff --git a/misc/ompl/pkg-plist b/misc/ompl/pkg-plist index 35b87d4c662d..e83cc2d2b269 100644 --- a/misc/ompl/pkg-plist +++ b/misc/ompl/pkg-plist @@ -1,265 +1,330 @@ %%PLANNERARENA%%bin/plannerarena include/ompl/base/ConstrainedSpaceInformation.h include/ompl/base/Constraint.h include/ompl/base/Cost.h include/ompl/base/DiscreteMotionValidator.h include/ompl/base/GenericParam.h include/ompl/base/Goal.h include/ompl/base/GoalTypes.h include/ompl/base/MotionValidator.h include/ompl/base/OptimizationObjective.h include/ompl/base/Path.h include/ompl/base/Planner.h include/ompl/base/PlannerData.h include/ompl/base/PlannerDataGraph.h include/ompl/base/PlannerDataStorage.h include/ompl/base/PlannerStatus.h include/ompl/base/PlannerTerminationCondition.h include/ompl/base/PrecomputedStateSampler.h include/ompl/base/ProblemDefinition.h include/ompl/base/ProjectionEvaluator.h include/ompl/base/ScopedState.h include/ompl/base/SolutionNonExistenceProof.h include/ompl/base/SpaceInformation.h include/ompl/base/State.h include/ompl/base/StateSampler.h include/ompl/base/StateSamplerArray.h include/ompl/base/StateSpace.h include/ompl/base/StateSpaceTypes.h include/ompl/base/StateStorage.h include/ompl/base/StateValidityChecker.h include/ompl/base/TypedSpaceInformation.h include/ompl/base/TypedStateValidityChecker.h include/ompl/base/ValidStateSampler.h include/ompl/base/goals/GoalLazySamples.h include/ompl/base/goals/GoalRegion.h include/ompl/base/goals/GoalSampleableRegion.h include/ompl/base/goals/GoalSpace.h include/ompl/base/goals/GoalState.h include/ompl/base/goals/GoalStates.h +include/ompl/base/objectives/ControlDurationObjective.h include/ompl/base/objectives/MaximizeMinClearanceObjective.h include/ompl/base/objectives/MechanicalWorkOptimizationObjective.h include/ompl/base/objectives/MinimaxObjective.h +include/ompl/base/objectives/MinimizeArrivalTime.h include/ompl/base/objectives/PathLengthOptimizationObjective.h include/ompl/base/objectives/StateCostIntegralObjective.h include/ompl/base/objectives/VFMechanicalWorkOptimizationObjective.h include/ompl/base/objectives/VFUpstreamCriterionOptimizationObjective.h include/ompl/base/samplers/BridgeTestValidStateSampler.h +include/ompl/base/samplers/ConditionalStateSampler.h include/ompl/base/samplers/DeterministicStateSampler.h include/ompl/base/samplers/GaussianValidStateSampler.h include/ompl/base/samplers/InformedStateSampler.h include/ompl/base/samplers/MaximizeClearanceValidStateSampler.h include/ompl/base/samplers/MinimumClearanceValidStateSampler.h include/ompl/base/samplers/ObstacleBasedValidStateSampler.h include/ompl/base/samplers/UniformValidStateSampler.h include/ompl/base/samplers/deterministic/DeterministicSequence.h include/ompl/base/samplers/deterministic/HaltonSequence.h include/ompl/base/samplers/deterministic/PrecomputedSequence.h include/ompl/base/samplers/informed/OrderedInfSampler.h include/ompl/base/samplers/informed/PathLengthDirectInfSampler.h include/ompl/base/samplers/informed/RejectionInfSampler.h include/ompl/base/spaces/DiscreteStateSpace.h include/ompl/base/spaces/DubinsStateSpace.h +include/ompl/base/spaces/EmptyStateSpace.h include/ompl/base/spaces/RealVectorBounds.h include/ompl/base/spaces/RealVectorStateProjections.h include/ompl/base/spaces/RealVectorStateSpace.h include/ompl/base/spaces/ReedsSheppStateSpace.h include/ompl/base/spaces/SE2StateSpace.h include/ompl/base/spaces/SE3StateSpace.h include/ompl/base/spaces/SO2StateSpace.h include/ompl/base/spaces/SO3StateSpace.h +include/ompl/base/spaces/SpaceTimeStateSpace.h include/ompl/base/spaces/TimeStateSpace.h include/ompl/base/spaces/WrapperStateSpace.h include/ompl/base/spaces/constraint/AtlasChart.h include/ompl/base/spaces/constraint/AtlasStateSpace.h include/ompl/base/spaces/constraint/ConstrainedStateSpace.h include/ompl/base/spaces/constraint/ProjectedStateSpace.h include/ompl/base/spaces/constraint/TangentBundleStateSpace.h +include/ompl/base/spaces/special/KleinBottleStateSpace.h +include/ompl/base/spaces/special/MobiusStateSpace.h +include/ompl/base/spaces/special/SphereStateSpace.h +include/ompl/base/spaces/special/TorusStateSpace.h include/ompl/base/terminationconditions/CostConvergenceTerminationCondition.h include/ompl/base/terminationconditions/IterationTerminationCondition.h include/ompl/config.h include/ompl/control/Control.h include/ompl/control/ControlSampler.h include/ompl/control/ControlSpace.h include/ompl/control/ControlSpaceTypes.h include/ompl/control/DirectedControlSampler.h include/ompl/control/ODESolver.h include/ompl/control/PathControl.h include/ompl/control/PlannerData.h include/ompl/control/PlannerDataStorage.h include/ompl/control/SimpleDirectedControlSampler.h include/ompl/control/SimpleSetup.h include/ompl/control/SpaceInformation.h include/ompl/control/StatePropagator.h include/ompl/control/SteeredControlSampler.h include/ompl/control/planners/PlannerIncludes.h include/ompl/control/planners/est/EST.h include/ompl/control/planners/kpiece/KPIECE1.h include/ompl/control/planners/ltl/Automaton.h include/ompl/control/planners/ltl/LTLPlanner.h include/ompl/control/planners/ltl/LTLProblemDefinition.h include/ompl/control/planners/ltl/LTLSpaceInformation.h include/ompl/control/planners/ltl/ProductGraph.h include/ompl/control/planners/ltl/PropositionalDecomposition.h include/ompl/control/planners/ltl/World.h include/ompl/control/planners/pdst/PDST.h include/ompl/control/planners/rrt/RRT.h include/ompl/control/planners/sst/SST.h include/ompl/control/planners/syclop/Decomposition.h include/ompl/control/planners/syclop/GridDecomposition.h include/ompl/control/planners/syclop/Syclop.h include/ompl/control/planners/syclop/SyclopEST.h include/ompl/control/planners/syclop/SyclopRRT.h include/ompl/control/spaces/DiscreteControlSpace.h include/ompl/control/spaces/RealVectorControlSpace.h include/ompl/datastructures/AdjacencyList.h include/ompl/datastructures/BinaryHeap.h include/ompl/datastructures/DynamicSSSP.h include/ompl/datastructures/GreedyKCenters.h include/ompl/datastructures/Grid.h include/ompl/datastructures/GridB.h include/ompl/datastructures/GridN.h include/ompl/datastructures/LPAstarOnGraph.h include/ompl/datastructures/NearestNeighbors.h include/ompl/datastructures/NearestNeighborsFLANN.h include/ompl/datastructures/NearestNeighborsGNAT.h include/ompl/datastructures/NearestNeighborsGNATNoThreadSafety.h include/ompl/datastructures/NearestNeighborsLinear.h include/ompl/datastructures/NearestNeighborsSqrtApprox.h include/ompl/datastructures/PDF.h include/ompl/datastructures/Permutation.h include/ompl/extensions/morse/MorseControlSpace.h include/ompl/extensions/morse/MorseEnvironment.h include/ompl/extensions/morse/MorseGoal.h include/ompl/extensions/morse/MorseProjection.h include/ompl/extensions/morse/MorseSimpleSetup.h include/ompl/extensions/morse/MorseStatePropagator.h include/ompl/extensions/morse/MorseStateSpace.h include/ompl/extensions/morse/MorseStateValidityChecker.h include/ompl/extensions/morse/MorseTerminationCondition.h include/ompl/extensions/ode/OpenDEControlSpace.h include/ompl/extensions/ode/OpenDEEnvironment.h include/ompl/extensions/ode/OpenDESimpleSetup.h include/ompl/extensions/ode/OpenDEStatePropagator.h include/ompl/extensions/ode/OpenDEStateSpace.h include/ompl/extensions/ode/OpenDEStateValidityChecker.h include/ompl/extensions/triangle/PropositionalTriangularDecomposition.h include/ompl/extensions/triangle/TriangularDecomposition.h include/ompl/geometric/GeneticSearch.h include/ompl/geometric/HillClimbing.h include/ompl/geometric/PathGeometric.h include/ompl/geometric/PathHybridization.h include/ompl/geometric/PathSimplifier.h include/ompl/geometric/SimpleSetup.h include/ompl/geometric/planners/AnytimePathShortening.h include/ompl/geometric/planners/PlannerIncludes.h include/ompl/geometric/planners/cforest/CForest.h include/ompl/geometric/planners/cforest/CForestStateSampler.h include/ompl/geometric/planners/cforest/CForestStateSpaceWrapper.h include/ompl/geometric/planners/est/BiEST.h include/ompl/geometric/planners/est/EST.h include/ompl/geometric/planners/est/ProjEST.h include/ompl/geometric/planners/experience/LightningRetrieveRepair.h include/ompl/geometric/planners/experience/ThunderRetrieveRepair.h include/ompl/geometric/planners/fmt/BFMT.h include/ompl/geometric/planners/fmt/FMT.h include/ompl/geometric/planners/informedtrees/ABITstar.h include/ompl/geometric/planners/informedtrees/AITstar.h include/ompl/geometric/planners/informedtrees/BITstar.h include/ompl/geometric/planners/informedtrees/aitstar/Edge.h include/ompl/geometric/planners/informedtrees/aitstar/ImplicitGraph.h +include/ompl/geometric/planners/informedtrees/aitstar/Queuetypes.h include/ompl/geometric/planners/informedtrees/aitstar/Vertex.h include/ompl/geometric/planners/informedtrees/bitstar/CostHelper.h include/ompl/geometric/planners/informedtrees/bitstar/HelperFunctions.h include/ompl/geometric/planners/informedtrees/bitstar/IdGenerator.h include/ompl/geometric/planners/informedtrees/bitstar/ImplicitGraph.h include/ompl/geometric/planners/informedtrees/bitstar/SearchQueue.h include/ompl/geometric/planners/informedtrees/bitstar/Vertex.h include/ompl/geometric/planners/kpiece/BKPIECE1.h include/ompl/geometric/planners/kpiece/Discretization.h include/ompl/geometric/planners/kpiece/KPIECE1.h include/ompl/geometric/planners/kpiece/LBKPIECE1.h include/ompl/geometric/planners/pdst/PDST.h include/ompl/geometric/planners/prm/ConnectionStrategy.h include/ompl/geometric/planners/prm/LazyPRM.h include/ompl/geometric/planners/prm/LazyPRMstar.h include/ompl/geometric/planners/prm/PRM.h include/ompl/geometric/planners/prm/PRMstar.h include/ompl/geometric/planners/prm/SPARS.h include/ompl/geometric/planners/prm/SPARStwo.h -include/ompl/geometric/planners/quotientspace/QRRT.h -include/ompl/geometric/planners/quotientspace/algorithms/MultiQuotient.h -include/ompl/geometric/planners/quotientspace/algorithms/MultiQuotientImpl.h -include/ompl/geometric/planners/quotientspace/algorithms/QRRTImpl.h -include/ompl/geometric/planners/quotientspace/datastructures/PlannerDataVertexAnnotated.h -include/ompl/geometric/planners/quotientspace/datastructures/QuotientSpace.h -include/ompl/geometric/planners/quotientspace/datastructures/QuotientSpaceGraph.h include/ompl/geometric/planners/rlrt/BiRLRT.h include/ompl/geometric/planners/rlrt/RLRT.h include/ompl/geometric/planners/rrt/BiTRRT.h include/ompl/geometric/planners/rrt/InformedRRTstar.h include/ompl/geometric/planners/rrt/LBTRRT.h include/ompl/geometric/planners/rrt/LazyLBTRRT.h include/ompl/geometric/planners/rrt/LazyRRT.h include/ompl/geometric/planners/rrt/RRT.h include/ompl/geometric/planners/rrt/RRTConnect.h include/ompl/geometric/planners/rrt/RRTXstatic.h include/ompl/geometric/planners/rrt/RRTsharp.h include/ompl/geometric/planners/rrt/RRTstar.h include/ompl/geometric/planners/rrt/SORRTstar.h +include/ompl/geometric/planners/rrt/STRRTstar.h include/ompl/geometric/planners/rrt/TRRT.h include/ompl/geometric/planners/rrt/TSRRT.h include/ompl/geometric/planners/rrt/VFRRT.h include/ompl/geometric/planners/rrt/pRRT.h include/ompl/geometric/planners/sbl/SBL.h include/ompl/geometric/planners/sbl/pSBL.h include/ompl/geometric/planners/sst/SST.h include/ompl/geometric/planners/stride/STRIDE.h include/ompl/geometric/planners/xxl/XXL.h include/ompl/geometric/planners/xxl/XXLDecomposition.h include/ompl/geometric/planners/xxl/XXLPlanarDecomposition.h include/ompl/geometric/planners/xxl/XXLPositionDecomposition.h +include/ompl/multilevel/datastructures/BundleSpace.h +include/ompl/multilevel/datastructures/BundleSpaceGraph.h +include/ompl/multilevel/datastructures/BundleSpaceSequence.h +include/ompl/multilevel/datastructures/BundleSpaceSequenceImpl.h +include/ompl/multilevel/datastructures/Parameter.h +include/ompl/multilevel/datastructures/ParameterExponentialDecay.h +include/ompl/multilevel/datastructures/ParameterSmoothStep.h +include/ompl/multilevel/datastructures/PlannerDataVertexAnnotated.h +include/ompl/multilevel/datastructures/PlannerMultiLevel.h +include/ompl/multilevel/datastructures/Projection.h +include/ompl/multilevel/datastructures/ProjectionFactory.h +include/ompl/multilevel/datastructures/ProjectionTypes.h +include/ompl/multilevel/datastructures/graphsampler/GraphSampler.h +include/ompl/multilevel/datastructures/graphsampler/RandomDegreeVertex.h +include/ompl/multilevel/datastructures/graphsampler/RandomEdge.h +include/ompl/multilevel/datastructures/graphsampler/RandomVertex.h +include/ompl/multilevel/datastructures/importance/BundleSpaceImportance.h +include/ompl/multilevel/datastructures/importance/Exponential.h +include/ompl/multilevel/datastructures/importance/Greedy.h +include/ompl/multilevel/datastructures/importance/Uniform.h +include/ompl/multilevel/datastructures/metrics/BundleSpaceMetric.h +include/ompl/multilevel/datastructures/metrics/Geodesic.h +include/ompl/multilevel/datastructures/pathrestriction/FindSection.h +include/ompl/multilevel/datastructures/pathrestriction/FindSectionSideStep.h +include/ompl/multilevel/datastructures/pathrestriction/FindSectionTypes.h +include/ompl/multilevel/datastructures/pathrestriction/Head.h +include/ompl/multilevel/datastructures/pathrestriction/HeadAnalyzer.h +include/ompl/multilevel/datastructures/pathrestriction/PathRestriction.h +include/ompl/multilevel/datastructures/pathrestriction/PathSection.h +include/ompl/multilevel/datastructures/projections/EmptySet.h +include/ompl/multilevel/datastructures/projections/FiberedProjection.h +include/ompl/multilevel/datastructures/projections/Identity.h +include/ompl/multilevel/datastructures/projections/None.h +include/ompl/multilevel/datastructures/projections/RNSO2_RN.h +include/ompl/multilevel/datastructures/projections/RN_RM.h +include/ompl/multilevel/datastructures/projections/Relaxation.h +include/ompl/multilevel/datastructures/projections/SE2RN_R2.h +include/ompl/multilevel/datastructures/projections/SE2_R2.h +include/ompl/multilevel/datastructures/projections/SE3RN_R3.h +include/ompl/multilevel/datastructures/projections/SE3_R3.h +include/ompl/multilevel/datastructures/projections/SO2N_SO2M.h +include/ompl/multilevel/datastructures/projections/XRN_X.h +include/ompl/multilevel/datastructures/projections/XRN_XRM.h +include/ompl/multilevel/datastructures/projections/XRN_XRM_SE2.h +include/ompl/multilevel/datastructures/projections/XRN_XRM_SE3.h +include/ompl/multilevel/datastructures/projections/XRN_XRM_SO2.h +include/ompl/multilevel/datastructures/projections/XRN_XRM_SO3.h +include/ompl/multilevel/datastructures/projections/XRN_X_SE2.h +include/ompl/multilevel/datastructures/projections/XRN_X_SE3.h +include/ompl/multilevel/datastructures/projections/XRN_X_SO2.h +include/ompl/multilevel/datastructures/projections/XRN_X_SO3.h +include/ompl/multilevel/datastructures/propagators/BundleSpacePropagator.h +include/ompl/multilevel/datastructures/propagators/Geometric.h +include/ompl/multilevel/planners/qmp/QMP.h +include/ompl/multilevel/planners/qmp/QMPImpl.h +include/ompl/multilevel/planners/qmp/QMPStar.h +include/ompl/multilevel/planners/qmp/QMPStarImpl.h +include/ompl/multilevel/planners/qrrt/QRRT.h +include/ompl/multilevel/planners/qrrt/QRRTImpl.h +include/ompl/multilevel/planners/qrrt/QRRTStar.h +include/ompl/multilevel/planners/qrrt/QRRTStarImpl.h include/ompl/tools/benchmark/Benchmark.h include/ompl/tools/benchmark/MachineSpecs.h include/ompl/tools/config/MagicConstants.h include/ompl/tools/config/SelfConfig.h include/ompl/tools/debug/PlannerMonitor.h include/ompl/tools/debug/Profiler.h include/ompl/tools/experience/ExperienceSetup.h include/ompl/tools/lightning/DynamicTimeWarp.h include/ompl/tools/lightning/Lightning.h include/ompl/tools/lightning/LightningDB.h include/ompl/tools/multiplan/OptimizePlan.h include/ompl/tools/multiplan/ParallelPlan.h include/ompl/tools/thunder/SPARSdb.h include/ompl/tools/thunder/Thunder.h include/ompl/tools/thunder/ThunderDB.h include/ompl/util/ClassForward.h include/ompl/util/Console.h include/ompl/util/DisableCompilerWarning.h include/ompl/util/Exception.h include/ompl/util/GeometricEquations.h include/ompl/util/Hash.h include/ompl/util/PPM.h include/ompl/util/ProlateHyperspheroid.h include/ompl/util/RandomNumbers.h include/ompl/util/String.h include/ompl/util/Time.h lib/libompl.so -lib/libompl.so.1.5.2 -lib/libompl.so.16 +lib/libompl.so.1.6.0 +lib/libompl.so.17 libdata/pkgconfig/ompl.pc -share/man/man1/ompl_benchmark_statistics.1.gz -%%PLANNERARENA%%share/man/man1/plannerarena.1.gz share/ament_index/resource_index/packages/ompl +share/man/man1/ompl_benchmark_statistics.1.gz +share/man/man1/plannerarena.1.gz %%DATADIR%%/cmake/omplConfig.cmake %%DATADIR%%/cmake/omplConfigVersion.cmake %%DATADIR%%/package.xml %%PLANNERARENA%%%%DATADIR%%/plannerarena/global.R %%PLANNERARENA%%%%DATADIR%%/plannerarena/plannerarena %%PLANNERARENA%%%%DATADIR%%/plannerarena/server.R %%PLANNERARENA%%%%DATADIR%%/plannerarena/ui.R %%PLANNERARENA%%%%DATADIR%%/plannerarena/www/ga.js %%PLANNERARENA%%%%DATADIR%%/plannerarena/www/help.md %%PLANNERARENA%%%%DATADIR%%/plannerarena/www/plannerarena.css %%PLANNERARENA%%%%DATADIR%%/plannerarena/www/plannerarena.js