31 #include "nav_msgs/GridCells.h" 34 int main(
int argc,
char** argv)
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;
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
void publish(const boost::shared_ptr< M > &message) 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()
INLINE Rall1d< T, V, S > sin(const Rall1d< T, V, S > &arg)