31 #include "nav_msgs/GridCells.h" 34 int main(
int argc,
char **argv )
36 ros::init( argc, argv,
"send_grid_cells" );
43 nav_msgs::GridCells msg;
46 msg.cells.resize( width * length );
47 msg.header.frame_id =
"base_link";
49 msg.cell_height = .01;
54 for(
int x = 0;
x < width;
x++ )
56 for(
int y = 0;
y < length;
y++ )
58 geometry_msgs::Point & point = msg.cells[
x +
y * width ];
61 point.z = sin(
x / 100.0 +
y / 100.0 + count / 100.0 );
65 msg.header.seq = count;
void publish(const boost::shared_ptr< M > &message) const
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
TFSIMD_FORCE_INLINE const tfScalar & y() const
int main(int argc, char **argv)
TFSIMD_FORCE_INLINE const tfScalar & x() const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
TFSIMD_FORCE_INLINE tfScalar length(const Quaternion &q)
ROSCPP_DECL void spinOnce()