37 #ifndef MOVEIT_COLLISION_DETECTION_FCL_COLLISION_WORLD_FCL_ 38 #define MOVEIT_COLLISION_DETECTION_FCL_COLLISION_WORLD_FCL_ 41 #include <fcl/broadphase/broadphase.h> 74 virtual void setWorld(
const WorldPtr& world);
85 std::unique_ptr<fcl::BroadPhaseCollisionManager>
manager_;
Representation of a collision checking request.
void updateFCLObject(const std::string &id)
void checkRobotCollisionHelper(const CollisionRequest &req, CollisionResult &res, const CollisionRobot &robot, const robot_state::RobotState &state, const AllowedCollisionMatrix *acm) const
virtual void distanceRobot(const DistanceRequest &req, DistanceResult &res, const CollisionRobot &robot, const robot_state::RobotState &state) const override
Compute the distance between a robot and the world.
virtual void distanceWorld(const DistanceRequest &req, DistanceResult &res, const CollisionWorld &world) const override
Compute the distance between another world.
Represents an action that occurred on an object in the world. Several bits may be set indicating seve...
Representation of a collision checking result.
std::unique_ptr< fcl::BroadPhaseCollisionManager > manager_
Generic interface to collision detection.
World::ObjectConstPtr ObjectConstPtr
virtual void setWorld(const WorldPtr &world)
A representation of an object.
void checkWorldCollisionHelper(const CollisionRequest &req, CollisionResult &res, const CollisionWorld &other_world, const AllowedCollisionMatrix *acm) const
virtual void checkWorldCollision(const CollisionRequest &req, CollisionResult &res, const CollisionWorld &other_world) const
Check whether a given set of objects is in collision with objects from another world. Any contacts are considered.
Definition of a structure for the allowed collision matrix. All elements in the collision world are r...
This class represents a collision model of the robot and can be used for self collision checks (to ch...
virtual void checkRobotCollision(const CollisionRequest &req, CollisionResult &res, const CollisionRobot &robot, const robot_state::RobotState &state) const
Check whether the robot model is in collision with the world. Any collisions between a robot link and...
virtual ~CollisionWorldFCL()
Perform collision checking with the environment. The collision world maintains a representation of th...
Representation of a robot's state. This includes position, velocity, acceleration and effort...
void notifyObjectChange(const ObjectConstPtr &obj, World::Action action)
World::ObserverHandle observer_handle_
std::map< std::string, FCLObject > fcl_objs_
void constructFCLObject(const World::Object *obj, FCLObject &fcl_obj) const