This defines a trajectory visualizer for publishing the smooth trajectory. More...
#include <moveit/robot_state/conversions.h>
#include <tf/transform_datatypes.h>
#include <pluginlib/class_list_macros.h>
#include <stomp_moveit/update_filters/trajectory_visualization.h>
Go to the source code of this file.
Namespaces | |
namespace | stomp_moveit |
namespace | stomp_moveit::update_filters |
Typedefs | |
typedef std::vector < geometry_msgs::Point > | ToolLine |
Functions | |
void | createToolPathMarker (const Eigen::MatrixXd &tool_line, int id, std::string frame_id, const std_msgs::ColorRGBA &rgb, double line_width, std::string ns, visualization_msgs::Marker &m) |
void | eigenToPointsMsgs (const Eigen::MatrixXd &in, std::vector< geometry_msgs::Point > &out) |
static Eigen::MatrixXd | jointsToToolPath (RobotState &state, const std::string &group_name, const Eigen::MatrixXd ¶meters) |
Creates a tool path xyz trajectory from the joint parameters. | |
PLUGINLIB_EXPORT_CLASS (stomp_moveit::update_filters::TrajectoryVisualization, stomp_moveit::update_filters::StompUpdateFilter) | |
Variables | |
static const int | MARKER_ID = 1 |
This defines a trajectory visualizer for publishing the smooth trajectory.
Definition in file trajectory_visualization.cpp.
typedef std::vector<geometry_msgs::Point> ToolLine |
Definition at line 34 of file trajectory_visualization.cpp.
void createToolPathMarker | ( | const Eigen::MatrixXd & | tool_line, |
int | id, | ||
std::string | frame_id, | ||
const std_msgs::ColorRGBA & | rgb, | ||
double | line_width, | ||
std::string | ns, | ||
visualization_msgs::Marker & | m | ||
) | [inline] |
Definition at line 80 of file trajectory_visualization.cpp.
void eigenToPointsMsgs | ( | const Eigen::MatrixXd & | in, |
std::vector< geometry_msgs::Point > & | out | ||
) | [inline] |
Definition at line 39 of file trajectory_visualization.cpp.
static Eigen::MatrixXd jointsToToolPath | ( | RobotState & | state, |
const std::string & | group_name, | ||
const Eigen::MatrixXd & | parameters | ||
) | [static] |
Creates a tool path xyz trajectory from the joint parameters.
state | The robot state |
parameters | The joint parameters [num_dimensions x num_timesteps] |
Definition at line 62 of file trajectory_visualization.cpp.
PLUGINLIB_EXPORT_CLASS | ( | stomp_moveit::update_filters::TrajectoryVisualization | , |
stomp_moveit::update_filters::StompUpdateFilter | |||
) |
const int MARKER_ID = 1 [static] |
Definition at line 37 of file trajectory_visualization.cpp.