36 #include <boost/format.hpp> 41 #define MAX_ELEMENTS_PER_LINE (65536 / 4) // from ros-visualization/rviz/src/rviz/ogre_helpers/billboard_line.cpp 46 "frame to visualize trajectory",
52 "duration to visualize trajectory",
58 "color of trajectory",
133 Ogre::Vector3 position;
134 Ogre::Quaternion orientation;
136 header, position, orientation)) {
138 (boost::format(
"Failed transforming from frame '%s' to frame '%s'")
139 % header.frame_id.c_str() % fixed_frame_id.c_str()).
str().c_str());
143 geometry_msgs::PointStamped new_point;
144 new_point.header.stamp =
now;
145 new_point.point.x = position[0];
146 new_point.point.y = position[1];
147 new_point.point.z = position[2];
150 for (std::vector<geometry_msgs::PointStamped>::iterator it =
trajectory_.begin();
rviz::TfFrameProperty * frame_property_
std::vector< geometry_msgs::PointStamped > trajectory_
void addPoint(const Ogre::Vector3 &point)
PLUGINLIB_EXPORT_CLASS(jsk_rviz_plugins::PictogramArrayDisplay, rviz::Display)
DisplayContext * context_
virtual QColor getColor() const
rviz::FloatProperty * duration_property_
rviz::BillboardLine * line_
rviz::ColorProperty * color_property_
rviz::FloatProperty * line_width_property_
virtual ~TFTrajectoryDisplay()
Ogre::SceneNode * scene_node_
#define MAX_ELEMENTS_PER_LINE
virtual FrameManager * getFrameManager() const=0
void setColor(float r, float g, float b, float a) override
virtual void onInitialize()
const std::string & getFixedFrame()
void setNumLines(uint32_t num)
void setMaxPointsPerLine(uint32_t max)
virtual Ogre::SceneManager * getSceneManager() const=0
virtual float getFloat() const
bool getTransform(const Header &header, Ogre::Vector3 &position, Ogre::Quaternion &orientation)
void setFrameManager(FrameManager *frame_manager)
virtual void update(float wall_dt, float ros_dt)
virtual void setStatus(StatusProperty::Level level, const QString &name, const QString &text)
void setLineWidth(float width)