#include <corbo-core/time_series.h>
#include <corbo-core/types.h>
#include <mpc_local_planner/systems/robot_dynamics_interface.h>
#include <geometry_msgs/PoseStamped.h>
#include <memory>
#include <string>
Go to the source code of this file.
Namespaces | |
mpc_local_planner | |
Functions | |
void | mpc_local_planner::convert (const corbo::TimeSeries &time_series, const RobotDynamicsInterface &dynamics, std::vector< geometry_msgs::PoseStamped > &poses_stamped, const std::string &frame_id) |
Convert TimeSeries to pose array. More... | |