moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <boost/algorithm/string.hpp>
#include <ros/ros.h>
#include <moveit/planning_interface/planning_interface.h>
#include <moveit/planning_scene/planning_scene.h>
#include <moveit_msgs/MotionPlanRequest.h>
#include <trajopt/trajectory_costs.hpp>
#include <trajopt_sco/expr_op_overloads.hpp>
#include <trajopt_sco/expr_ops.hpp>
#include <trajopt_utils/eigen_slicing.hpp>
#include <trajopt_utils/logging.hpp>
#include <trajopt_utils/vector_ops.hpp>
#include <trajopt_interface/problem_description.h>
#include <trajopt_interface/kinematic_terms.h>
Go to the source code of this file.
Namespaces | |
trajopt_interface | |
Functions | |
void | checkParameterSize (trajopt::DblVec ¶meter, const unsigned int &expected_size, const std::string &name, const bool &apply_first=true) |
Checks the size of the parameter given and throws if incorrect. More... | |
TrajOptProblemPtr | trajopt_interface::ConstructProblem (const ProblemInfo &) |
void | trajopt_interface::generateInitialTrajectory (const ProblemInfo &pci, const std::vector< double > ¤t_joint_values, trajopt::TrajArray &init_traj) |
void checkParameterSize | ( | trajopt::DblVec & | parameter, |
const unsigned int & | expected_size, | ||
const std::string & | name, | ||
const bool & | apply_first = true |
||
) |
Checks the size of the parameter given and throws if incorrect.
parameter | The vector whose size is getting checked |
expected_size | The expected size of the vector |
name | The name to use when printing an error or warning |
apply_first | If true and only one value is given, broadcast value to length of expected_size |
Definition at line 59 of file problem_description.cpp.