#include "ros/ros.h"
#include "visualization_msgs/Marker.h"
#include "visualization_msgs/MarkerArray.h"
#include <tf2_ros/transform_broadcaster.h>
#include <geometry_msgs/TransformStamped.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
Go to the source code of this file.
|
void | emitRow (const std::string &type_name, uint32_t type, int32_t x_pos, float r, float g, float b, const ros::Duration &lifetime, ros::Publisher &pub, bool frame_locked=true, const std::string &frame_id=std::string("base_link"), float sx=1.0, float sy=1.0, float sz=1.0) |
|
void | frameCallback (const ros::TimerEvent &) |
|
int | main (int argc, char **argv) |
|
void | publishCallback (const ros::TimerEvent &) |
|
◆ emitRow()
void emitRow |
( |
const std::string & |
type_name, |
|
|
uint32_t |
type, |
|
|
int32_t |
x_pos, |
|
|
float |
r, |
|
|
float |
g, |
|
|
float |
b, |
|
|
const ros::Duration & |
lifetime, |
|
|
ros::Publisher & |
pub, |
|
|
bool |
frame_locked = true , |
|
|
const std::string & |
frame_id = std::string("base_link") , |
|
|
float |
sx = 1.0 , |
|
|
float |
sy = 1.0 , |
|
|
float |
sz = 1.0 |
|
) |
| |
◆ frameCallback()
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ publishCallback()
◆ g_marker_pub
rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust, William Woodall
autogenerated on Fri Aug 2 2024 08:43:10