moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <ament_index_cpp/get_package_share_directory.hpp>
#include <boost/algorithm/string_regex.hpp>
#include <filesystem>
#include <geometry_msgs/msg/pose.hpp>
#include <moveit/utils/robot_model_test_utils.h>
#include <rclcpp/logger.hpp>
#include <rclcpp/logging.hpp>
#include <urdf_parser/urdf_parser.h>
#include <moveit/utils/logger.hpp>
#include <pluginlib/class_loader.hpp>
#include <moveit/kinematics_base/kinematics_base.h>
Go to the source code of this file.
Namespaces | |
namespace | moveit |
Main namespace for MoveIt. | |
namespace | moveit::core |
Core components of MoveIt. | |
Functions | |
moveit::core::RobotModelPtr | moveit::core::loadTestingRobotModel (const std::string &package_name, const std::string &urdf_relative_path, const std::string &srdf_relative_path) |
Loads a robot model given a URDF and SRDF file in a package. | |
moveit::core::RobotModelPtr | moveit::core::loadTestingRobotModel (const std::string &robot_name) |
Loads a robot from moveit_resources. | |
urdf::ModelInterfaceSharedPtr | moveit::core::loadModelInterface (const std::string &robot_name) |
Loads a URDF Model Interface from moveit_resources. | |
srdf::ModelSharedPtr | moveit::core::loadSRDFModel (const std::string &robot_name) |
Loads an SRDF Model from moveit_resources. | |
void | moveit::core::loadIKPluginForGroup (const rclcpp::Node::SharedPtr &node, JointModelGroup *jmg, const std::string &base_link, const std::string &tip_link, std::string plugin="KDL", double timeout=0.1) |
Load an IK solver plugin for the given joint model group. | |