Go to the documentation of this file.
41 std::string file_name;
54 any_solver->SpecifyProblem(any_problem);
58 Eigen::VectorXd
q = Eigen::VectorXd::Zero(my_problem->N);
59 Eigen::MatrixXd solution;
61 my_problem->q_nominal =
q;
63 HIGHLIGHT(
"Calling solve() in an infinite loop");
73 my_problem->cost.y = {0.6,
74 -0.1 +
sin(
t * 2.0 *
M_PI * 0.5) * 0.1,
75 0.5 +
sin(
t *
M_PI * 0.5) * 0.2, 0, 0, 0};
78 my_problem->SetStartState(
q);
79 any_solver->Solve(solution);
83 my_problem->Update(
q);
84 my_problem->GetScene()->GetKinematicTree().PublishFrames();
93 int main(
int argc,
char **argv)
95 ros::init(argc, argv,
"example_cpp_init_xml_node");
int main(int argc, char **argv)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
static bool GetParam(const std::string &name, T ¶m)
ROSCPP_DECL void spinOnce()
static std::shared_ptr< exotica::PlanningProblem > CreateProblem(const Initializer &init)
#define HIGHLIGHT_NAMED(name, x)
static void InitRos(std::shared_ptr< ros::NodeHandle > nh, int numThreads=2)
std::shared_ptr< exotica::UnconstrainedEndPoseProblem > UnconstrainedEndPoseProblemPtr
static std::shared_ptr< exotica::MotionSolver > CreateSolver(const Initializer &init)
std::shared_ptr< PlanningProblem > PlanningProblemPtr
static Initializer Load(std::string file_name, bool parsePathAsXML=false)
std::shared_ptr< exotica::MotionSolver > MotionSolverPtr