moveit2
The MoveIt Motion Planning Framework for ROS 2.
Typedefs | Functions
save_as_text.cpp File Reference
#include <moveit/warehouse/planning_scene_storage.h>
#include <moveit/warehouse/state_storage.h>
#include <moveit/warehouse/constraints_storage.h>
#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 <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <moveit/robot_state/conversions.h>
#include <rclcpp/executors.hpp>
#include <rclcpp/logger.hpp>
#include <rclcpp/logging.hpp>
#include <rclcpp/node.hpp>
#include <rclcpp/node_options.hpp>
#include <rclcpp/utilities.hpp>
Include dependency graph for save_as_text.cpp:

Go to the source code of this file.

Typedefs

typedef std::pair< geometry_msgs::msg::Point, geometry_msgs::msg::Quaternion > LinkConstraintPair
 
typedef std::map< std::string, LinkConstraintPairLinkConstraintMap
 

Functions

void collectLinkConstraints (const moveit_msgs::msg::Constraints &constraints, LinkConstraintMap &lcmap)
 
int main (int argc, char **argv)
 

Typedef Documentation

◆ LinkConstraintMap

typedef std::map<std::string, LinkConstraintPair> LinkConstraintMap

Definition at line 58 of file save_as_text.cpp.

◆ LinkConstraintPair

typedef std::pair<geometry_msgs::msg::Point, geometry_msgs::msg::Quaternion> LinkConstraintPair

Definition at line 57 of file save_as_text.cpp.

Function Documentation

◆ collectLinkConstraints()

void collectLinkConstraints ( const moveit_msgs::msg::Constraints &  constraints,
LinkConstraintMap lcmap 
)

Definition at line 60 of file save_as_text.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 84 of file save_as_text.cpp.

Here is the call graph for this function: