This hybrid collision environment combines FCL and a distance field. Both can be used to calculate collisions.
More...
|
void | checkCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state) const |
|
void | checkCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const |
|
void | checkCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm, GroupStateRepresentationPtr &gsr) const |
|
void | checkCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, GroupStateRepresentationPtr &gsr) const |
|
void | checkRobotCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state) const |
|
void | checkRobotCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const |
|
void | checkRobotCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm, GroupStateRepresentationPtr &gsr) const |
|
void | checkRobotCollisionDistanceField (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, GroupStateRepresentationPtr &gsr) const |
|
void | checkSelfCollisionDistanceField (const collision_detection::CollisionRequest &req, collision_detection::CollisionResult &res, const moveit::core::RobotState &state) const |
|
void | checkSelfCollisionDistanceField (const collision_detection::CollisionRequest &req, collision_detection::CollisionResult &res, const moveit::core::RobotState &state, const collision_detection::AllowedCollisionMatrix &acm) const |
|
void | checkSelfCollisionDistanceField (const collision_detection::CollisionRequest &req, collision_detection::CollisionResult &res, const moveit::core::RobotState &state, const collision_detection::AllowedCollisionMatrix &acm, GroupStateRepresentationPtr &gsr) const |
|
void | checkSelfCollisionDistanceField (const collision_detection::CollisionRequest &req, collision_detection::CollisionResult &res, const moveit::core::RobotState &state, GroupStateRepresentationPtr &gsr) const |
|
| CollisionEnvHybrid (const CollisionEnvHybrid &other, const WorldPtr &world) |
|
EIGEN_MAKE_ALIGNED_OPERATOR_NEW | CollisionEnvHybrid (const moveit::core::RobotModelConstPtr &robot_model, const std::map< std::string, std::vector< CollisionSphere >> &link_body_decompositions=std::map< std::string, std::vector< CollisionSphere >>(), double size_x=DEFAULT_SIZE_X, double size_y=DEFAULT_SIZE_Y, double size_z=DEFAULT_SIZE_Z, const Eigen::Vector3d &origin=Eigen::Vector3d(0, 0, 0), bool use_signed_distance_field=DEFAULT_USE_SIGNED_DISTANCE_FIELD, double resolution=DEFAULT_RESOLUTION, double collision_tolerance=DEFAULT_COLLISION_TOLERANCE, double max_propogation_distance=DEFAULT_MAX_PROPOGATION_DISTANCE, double padding=0.0, double scale=1.0) |
|
| CollisionEnvHybrid (const moveit::core::RobotModelConstPtr &robot_model, const WorldPtr &world, const std::map< std::string, std::vector< CollisionSphere >> &link_body_decompositions=std::map< std::string, std::vector< CollisionSphere >>(), double size_x=DEFAULT_SIZE_X, double size_y=DEFAULT_SIZE_Y, double size_z=DEFAULT_SIZE_Z, const Eigen::Vector3d &origin=Eigen::Vector3d(0, 0, 0), bool use_signed_distance_field=DEFAULT_USE_SIGNED_DISTANCE_FIELD, double resolution=DEFAULT_RESOLUTION, double collision_tolerance=DEFAULT_COLLISION_TOLERANCE, double max_propogation_distance=DEFAULT_MAX_PROPOGATION_DISTANCE, double padding=0.0, double scale=1.0) |
|
void | getAllCollisions (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix *acm, GroupStateRepresentationPtr &gsr) const |
|
void | getCollisionGradients (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix *acm, GroupStateRepresentationPtr &gsr) const |
|
const CollisionEnvDistanceFieldConstPtr | getCollisionRobotDistanceField () const |
|
const CollisionEnvDistanceFieldConstPtr | getCollisionWorldDistanceField () const |
|
void | initializeRobotDistanceField (const std::map< std::string, std::vector< CollisionSphere >> &link_body_decompositions, double size_x, double size_y, double size_z, bool use_signed_distance_field, double resolution, double collision_tolerance, double max_propogation_distance) |
|
void | setWorld (const WorldPtr &world) override |
|
| ~CollisionEnvHybrid () override |
|
void | checkRobotCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state) const override |
| Check whether the robot model is in collision with the world. Any collisions between a robot link and the world are considered. Self collisions are not checked. More...
|
|
void | checkRobotCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const override |
| Check whether the robot model is in collision with the world. Allowed collisions are ignored. Self collisions are not checked. More...
|
|
void | checkRobotCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state1, const moveit::core::RobotState &state2) const override |
| Check whether the robot model is in collision with the world in a continuous manner (between two robot states). Allowed collisions are ignored. Self collisions are not checked. More...
|
|
void | checkRobotCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state1, const moveit::core::RobotState &state2, const AllowedCollisionMatrix &acm) const override |
| Check whether the robot model is in collision with the world in a continuous manner (between two robot states). Allowed collisions are ignored. Self collisions are not checked. More...
|
|
void | checkSelfCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state) const override |
| Check for robot self collision. Any collision between any pair of links is checked for, NO collisions are ignored. More...
|
|
void | checkSelfCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const override |
| Check for self collision. Allowed collisions specified by the allowed collision matrix are taken into account. More...
|
|
| CollisionEnvFCL ()=delete |
|
| CollisionEnvFCL (const CollisionEnvFCL &other, const WorldPtr &world) |
|
| CollisionEnvFCL (const moveit::core::RobotModelConstPtr &model, const WorldPtr &world, double padding=0.0, double scale=1.0) |
|
| CollisionEnvFCL (const moveit::core::RobotModelConstPtr &model, double padding=0.0, double scale=1.0) |
|
void | distanceRobot (const DistanceRequest &req, DistanceResult &res, const moveit::core::RobotState &state) const override |
| Compute the distance between a robot and the world. More...
|
|
void | distanceSelf (const DistanceRequest &req, DistanceResult &res, const moveit::core::RobotState &state) const override |
| The distance to self-collision given the robot is at state state. More...
|
|
| ~CollisionEnvFCL () override |
|
virtual void | checkCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state) const |
| Check whether the robot model is in collision with itself or the world at a particular state. Any collision between any pair of links is checked for, NO collisions are ignored. More...
|
|
virtual void | checkCollision (const CollisionRequest &req, CollisionResult &res, const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const |
| Check whether the robot model is in collision with itself or the world at a particular state. Allowed collisions specified by the allowed collision matrix are taken into account. More...
|
|
| CollisionEnv ()=delete |
|
| CollisionEnv (const CollisionEnv &other, const WorldPtr &world) |
| Copy constructor. More...
|
|
| CollisionEnv (const moveit::core::RobotModelConstPtr &model, const WorldPtr &world, double padding=0.0, double scale=1.0) |
| Constructor. More...
|
|
| CollisionEnv (const moveit::core::RobotModelConstPtr &model, double padding=0.0, double scale=1.0) |
| Constructor. More...
|
|
double | distanceRobot (const moveit::core::RobotState &state, bool verbose=false) const |
| Compute the shortest distance between a robot and the world. More...
|
|
double | distanceRobot (const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm, bool verbose=false) const |
| Compute the shortest distance between a robot and the world. More...
|
|
double | distanceSelf (const moveit::core::RobotState &state) const |
| The distance to self-collision given the robot is at state state. More...
|
|
double | distanceSelf (const moveit::core::RobotState &state, const AllowedCollisionMatrix &acm) const |
| The distance to self-collision given the robot is at state state, ignoring the distances between links that are allowed to always collide (as specified by. More...
|
|
const std::map< std::string, double > & | getLinkPadding () const |
| Get the link paddings as a map (from link names to padding value) More...
|
|
double | getLinkPadding (const std::string &link_name) const |
| Get the link padding for a particular link. More...
|
|
const std::map< std::string, double > & | getLinkScale () const |
| Get the link scaling as a map (from link names to scale value) More...
|
|
double | getLinkScale (const std::string &link_name) const |
| Set the scaling for a particular link. More...
|
|
void | getPadding (std::vector< moveit_msgs::LinkPadding > &padding) const |
| Get the link padding as a vector of messages. More...
|
|
const moveit::core::RobotModelConstPtr & | getRobotModel () const |
| The kinematic model corresponding to this collision model. More...
|
|
void | getScale (std::vector< moveit_msgs::LinkScale > &scale) const |
| Get the link scaling as a vector of messages. More...
|
|
const WorldPtr & | getWorld () |
|
const WorldConstPtr & | getWorld () const |
|
void | setLinkPadding (const std::map< std::string, double > &padding) |
| Set the link paddings using a map (from link names to padding value) More...
|
|
void | setLinkPadding (const std::string &link_name, double padding) |
| Set the link padding for a particular link. More...
|
|
void | setLinkScale (const std::map< std::string, double > &scale) |
| Set the link scaling using a map (from link names to scale value) More...
|
|
void | setLinkScale (const std::string &link_name, double scale) |
| Set the scaling for a particular link. More...
|
|
void | setPadding (const std::vector< moveit_msgs::LinkPadding > &padding) |
| Set the link padding from a vector of messages. More...
|
|
void | setPadding (double padding) |
| Set the link padding (for every link) More...
|
|
void | setScale (const std::vector< moveit_msgs::LinkScale > &scale) |
| Set the link scaling from a vector of messages. More...
|
|
void | setScale (double scale) |
| Set the link scaling (for every link) More...
|
|
virtual | ~CollisionEnv () |
|
This hybrid collision environment combines FCL and a distance field. Both can be used to calculate collisions.
Definition at line 82 of file collision_env_hybrid.h.