|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <boost/algorithm/string.hpp>#include <moveit/planning_scene/planning_scene.hpp>#include <moveit/collision_detection/occupancy_map.hpp>#include <moveit/collision_detection_fcl/collision_detector_allocator_fcl.hpp>#include <geometric_shapes/shape_operations.h>#include <moveit/collision_detection/collision_tools.hpp>#include <moveit/trajectory_processing/trajectory_tools.hpp>#include <moveit/robot_state/conversions.hpp>#include <moveit/exceptions/exceptions.hpp>#include <moveit/robot_state/attached_body.hpp>#include <moveit/utils/message_checks.hpp>#include <octomap_msgs/conversions.h>#include <rclcpp/logger.hpp>#include <rclcpp/logging.hpp>#include <tf2_eigen/tf2_eigen.hpp>#include <memory>#include <set>#include <moveit/utils/logger.hpp>
Go to the source code of this file.
Classes | |
| class | planning_scene::SceneTransforms |
Namespaces | |
| namespace | planning_scene |
| This namespace includes the central class for representing planning contexts. | |
| namespace | planning_scene::utilities |
Functions | |
| void | planning_scene::utilities::poseMsgToEigen (const geometry_msgs::msg::Pose &msg, Eigen::Isometry3d &out) |
| bool | planning_scene::utilities::readPoseFromText (std::istream &in, Eigen::Isometry3d &pose) |
| Read a pose from text. | |
| void | planning_scene::utilities::writePoseToText (std::ostream &out, const Eigen::Isometry3d &pose) |
| Write a pose to text. | |
| collision_detection::OccMapTreePtr | planning_scene::createOctomap (const octomap_msgs::msg::Octomap &map) |