38 #include <rclcpp/executors/multi_threaded_executor.hpp>
39 #include <rclcpp/node.hpp>
40 #include <rclcpp/utilities.hpp>
42 static const std::string ROBOT_DESCRIPTION =
"robot_description";
44 using namespace std::chrono_literals;
46 int main(
int argc,
char** argv)
48 rclcpp::init(argc, argv);
49 auto node = rclcpp::Node::make_shared(
"print_model_info_to_console");
51 rclcpp::executors::MultiThreadedExecutor executor;
52 executor.add_node(node);
55 rclcpp::sleep_for(500ms);
57 rml.
getModel()->printModelInfo(std::cout);
const moveit::core::RobotModelPtr & getModel() const
Get the constructed planning_models::RobotModel.
int main(int argc, char **argv)