Skip to content

Commit d7cfaba

Browse files
committed
grid_cells example: reduce rate
1 parent 8849394 commit d7cfaba

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

src/test/send_grid_cells_node.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -38,7 +38,7 @@ int main(int argc, char** argv)
3838
ros::NodeHandle nh;
3939

4040
ros::Publisher pub = nh.advertise<nav_msgs::GridCells>("grid_cells", 100);
41-
ros::Rate loop_rate(100);
41+
ros::Rate loop_rate(30);
4242

4343
nav_msgs::GridCells msg;
4444
int width = 500;

0 commit comments

Comments
 (0)