moveit2
The MoveIt Motion Planning Framework for ROS 2.
Functions
save_to_warehouse.cpp File Reference
#include <moveit/warehouse/planning_scene_storage.h>
#include <moveit/warehouse/constraints_storage.h>
#include <moveit/warehouse/state_storage.h>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <moveit/utils/logger.hpp>
#include <boost/program_options/cmdline.hpp>
#include <boost/program_options/options_description.hpp>
#include <boost/program_options/parsers.hpp>
#include <boost/program_options/variables_map.hpp>
#include <fmt/format.h>
#include <tf2_ros/transform_listener.h>
#include <rclcpp/executors.hpp>
#include <rclcpp/experimental/buffers/intra_process_buffer.hpp>
#include <rclcpp/logger.hpp>
#include <rclcpp/logging.hpp>
#include <rclcpp/node.hpp>
#include <rclcpp/node_options.hpp>
#include <rclcpp/version.h>
#include <rclcpp/qos_event.hpp>
#include <rclcpp/subscription.hpp>
#include <rclcpp/utilities.hpp>
Include dependency graph for save_to_warehouse.cpp:

Go to the source code of this file.

Functions

rclcpp::Logger getLogger ()
 
void onSceneUpdate (planning_scene_monitor::PlanningSceneMonitor &psm, moveit_warehouse::PlanningSceneStorage &pss)
 
void onMotionPlanRequest (const moveit_msgs::msg::MotionPlanRequest &req, planning_scene_monitor::PlanningSceneMonitor &psm, moveit_warehouse::PlanningSceneStorage &pss)
 
void onConstraints (const moveit_msgs::msg::Constraints &msg, moveit_warehouse::ConstraintsStorage &cs)
 
void onRobotState (const moveit_msgs::msg::RobotState &msg, moveit_warehouse::RobotStateStorage &rs)
 
int main (int argc, char **argv)
 

Function Documentation

◆ getLogger()

rclcpp::Logger getLogger ( )

Definition at line 63 of file save_to_warehouse.cpp.

Here is the call graph for this function:
Here is the caller graph for this function:

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 137 of file save_to_warehouse.cpp.

Here is the call graph for this function:

◆ onConstraints()

void onConstraints ( const moveit_msgs::msg::Constraints &  msg,
moveit_warehouse::ConstraintsStorage cs 
)

Definition at line 103 of file save_to_warehouse.cpp.

Here is the call graph for this function:

◆ onMotionPlanRequest()

void onMotionPlanRequest ( const moveit_msgs::msg::MotionPlanRequest &  req,
planning_scene_monitor::PlanningSceneMonitor psm,
moveit_warehouse::PlanningSceneStorage pss 
)

Definition at line 92 of file save_to_warehouse.cpp.

Here is the call graph for this function:

◆ onRobotState()

void onRobotState ( const moveit_msgs::msg::RobotState &  msg,
moveit_warehouse::RobotStateStorage rs 
)

Definition at line 124 of file save_to_warehouse.cpp.

Here is the call graph for this function:

◆ onSceneUpdate()

Definition at line 70 of file save_to_warehouse.cpp.

Here is the call graph for this function: